The main file, nodelet implementation code. More...
#include <ros/ros.h>
#include <points_from_volume/points_from_volume.h>
Go to the source code of this file.
Functions | |
void | cb_points_convexhull (const sensor_msgs::PointCloud2ConstPtr &pcmsg_convexhull_in) |
ConvexHull callback. | |
void | cloud_cb (const sensor_msgs::PointCloud2ConstPtr &pcmsg_in) |
Point Cloud callback. | |
int | main (int argc, char **argv) |
Main code of the nodelet. | |
Variables | |
ros::Publisher | cloud_pub |
bool | defined_hull = false |
bool | flag |
double | negative |
ros::NodeHandle * | p_n |
points_from_volume< pcl::PointXYZ > | piv |
double | positive |
The main file, nodelet implementation code.
Definition in file points_from_volume_nodelet.cpp.
void cb_points_convexhull | ( | const sensor_msgs::PointCloud2ConstPtr & | pcmsg_convexhull_in | ) |
ConvexHull callback.
This callback sets a flag to true (when the convexhull is received), allowing the rest of the code to run
const | sensor_msgs::PointCloud2ConstPtr & pcmsg_convexhull_in |
Definition at line 74 of file points_from_volume_nodelet.cpp.
void cloud_cb | ( | const sensor_msgs::PointCloud2ConstPtr & | pcmsg_in | ) |
Point Cloud callback.
This callback makes use of the convexhull class created
const | sensor_msgs::PointCloud2ConstPtr & pcmsg_in |
Definition at line 55 of file points_from_volume_nodelet.cpp.
int main | ( | int | argc, | |
char ** | argv | |||
) |
Main code of the nodelet.
Initializes params and receive and pubish pointclouds
argc | ||
argv |
Definition at line 90 of file points_from_volume_nodelet.cpp.
ros::Publisher cloud_pub |
Definition at line 41 of file points_from_volume_nodelet.cpp.
bool defined_hull = false |
Definition at line 42 of file points_from_volume_nodelet.cpp.
bool flag |
Definition at line 45 of file points_from_volume_nodelet.cpp.
double negative |
Definition at line 44 of file points_from_volume_nodelet.cpp.
ros::NodeHandle* p_n |
Definition at line 40 of file points_from_volume_nodelet.cpp.
points_from_volume<pcl::PointXYZ> piv |
Definition at line 47 of file points_from_volume_nodelet.cpp.
double positive |
Definition at line 43 of file points_from_volume_nodelet.cpp.