| 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 | wait_ | 
| Protected Attributes | |
| ros::NodeHandle | nh_ | 
| ros::NodeHandle | private_nh_ | 
| string | tf_frame_ | 
Definition at line 57 of file pcd_to_pointcloud.cpp.
| 
 | inline | 
Definition at line 74 of file pcd_to_pointcloud.cpp.
| 
 | inline | 
Definition at line 97 of file pcd_to_pointcloud.cpp.
| 
 | inline | 
Definition at line 87 of file pcd_to_pointcloud.cpp.
| sensor_msgs::PointCloud2 PCDGenerator::cloud_ | 
Definition at line 66 of file pcd_to_pointcloud.cpp.
| string PCDGenerator::cloud_topic_ | 
Definition at line 68 of file pcd_to_pointcloud.cpp.
| string PCDGenerator::file_name_ | 
Definition at line 68 of file pcd_to_pointcloud.cpp.
| 
 | protected | 
Definition at line 61 of file pcd_to_pointcloud.cpp.
| 
 | protected | 
Definition at line 62 of file pcd_to_pointcloud.cpp.
| pcl_ros::Publisher<sensor_msgs::PointCloud2> PCDGenerator::pub_ | 
Definition at line 71 of file pcd_to_pointcloud.cpp.
| 
 | protected | 
Definition at line 60 of file pcd_to_pointcloud.cpp.
| double PCDGenerator::wait_ | 
Definition at line 69 of file pcd_to_pointcloud.cpp.