| Public Member Functions | |
| void | cloud_cb (const boost::shared_ptr< const pcl::PCLPointCloud2 > &cloud) | 
| PointCloudToPCD () | |
| Public Attributes | |
| string | cloud_topic_ | 
| ros::Subscriber | sub_ | 
| Protected Attributes | |
| ros::NodeHandle | nh_ | 
| Private Attributes | |
| bool | binary_ | 
| bool | compressed_ | 
| std::string | filename_ | 
| std::string | fixed_frame_ | 
| std::string | prefix_ | 
| tf2_ros::Buffer | tf_buffer_ | 
| tf2_ros::TransformListener | tf_listener_ | 
pointcloud_to_pcd is a simple node that retrieves a ROS point cloud message and saves it to disk into a PCD (Point Cloud Data) file format.
Definition at line 59 of file pointcloud_to_pcd.cpp.
| 
 | inline | 
Definition at line 137 of file pointcloud_to_pcd.cpp.
| 
 | inline | 
Definition at line 81 of file pointcloud_to_pcd.cpp.
| 
 | private | 
Definition at line 67 of file pointcloud_to_pcd.cpp.
| string PointCloudToPCD::cloud_topic_ | 
Definition at line 74 of file pointcloud_to_pcd.cpp.
| 
 | private | 
Definition at line 68 of file pointcloud_to_pcd.cpp.
| 
 | private | 
Definition at line 66 of file pointcloud_to_pcd.cpp.
| 
 | private | 
Definition at line 69 of file pointcloud_to_pcd.cpp.
| 
 | protected | 
Definition at line 62 of file pointcloud_to_pcd.cpp.
| 
 | private | 
Definition at line 65 of file pointcloud_to_pcd.cpp.
| ros::Subscriber PointCloudToPCD::sub_ | 
Definition at line 76 of file pointcloud_to_pcd.cpp.
| 
 | private | 
Definition at line 70 of file pointcloud_to_pcd.cpp.
| 
 | private | 
Definition at line 71 of file pointcloud_to_pcd.cpp.