$search
Public Member Functions | |
PCDGenerator () | |
bool | spin () |
int | start () |
Public Attributes | |
sensor_msgs::PointCloud2 | cloud_ |
string | cloud_topic_ |
string | file_name_ |
pcl_ros::Publisher < sensor_msgs::PointCloud2 > | pub_ |
double | rate_ |
Protected Attributes | |
ros::NodeHandle | nh_ |
ros::NodeHandle | private_nh_ |
string | tf_frame_ |
Definition at line 56 of file pcd_to_pointcloud.cpp.
PCDGenerator::PCDGenerator | ( | ) | [inline] |
Definition at line 73 of file pcd_to_pointcloud.cpp.
bool PCDGenerator::spin | ( | ) | [inline] |
Definition at line 96 of file pcd_to_pointcloud.cpp.
int PCDGenerator::start | ( | ) | [inline] |
Definition at line 86 of file pcd_to_pointcloud.cpp.
Definition at line 65 of file pcd_to_pointcloud.cpp.
string PCDGenerator::cloud_topic_ |
Definition at line 67 of file pcd_to_pointcloud.cpp.
string PCDGenerator::file_name_ |
Definition at line 67 of file pcd_to_pointcloud.cpp.
ros::NodeHandle PCDGenerator::nh_ [protected] |
Definition at line 60 of file pcd_to_pointcloud.cpp.
ros::NodeHandle PCDGenerator::private_nh_ [protected] |
Definition at line 61 of file pcd_to_pointcloud.cpp.
Definition at line 70 of file pcd_to_pointcloud.cpp.
double PCDGenerator::rate_ |
Definition at line 68 of file pcd_to_pointcloud.cpp.
string PCDGenerator::tf_frame_ [protected] |
Definition at line 59 of file pcd_to_pointcloud.cpp.