Public Member Functions | |
void | cloud_cb (const sensor_msgs::PointCloud2ConstPtr &cloud) |
PointCloudToPCD () | |
Public Attributes | |
string | cloud_topic_ |
ros::Subscriber | sub_ |
Protected Attributes | |
ros::NodeHandle | nh_ |
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 54 of file pointcloud_to_pcd.cpp.
PointCloudToPCD::PointCloudToPCD | ( | ) | [inline] |
Definition at line 87 of file pointcloud_to_pcd.cpp.
void PointCloudToPCD::cloud_cb | ( | const sensor_msgs::PointCloud2ConstPtr & | cloud | ) | [inline] |
Definition at line 67 of file pointcloud_to_pcd.cpp.
Definition at line 60 of file pointcloud_to_pcd.cpp.
ros::NodeHandle PointCloudToPCD::nh_ [protected] |
Definition at line 57 of file pointcloud_to_pcd.cpp.
ros::Subscriber PointCloudToPCD::sub_ |
Definition at line 62 of file pointcloud_to_pcd.cpp.