Public Member Functions | |
void | cloud_cb (const pcl::PCLPointCloud2::ConstPtr &cloud) |
PointCloudToPCD () | |
Public Attributes | |
string | cloud_topic_ |
ros::Subscriber | sub_ |
Protected Attributes | |
ros::NodeHandle | nh_ |
Private Attributes | |
bool | binary_ |
bool | compressed_ |
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 65 of file pointcloud_to_pcd.cpp.
|
inline |
Definition at line 135 of file pointcloud_to_pcd.cpp.
|
inline |
Definition at line 86 of file pointcloud_to_pcd.cpp.
|
private |
Definition at line 72 of file pointcloud_to_pcd.cpp.
string PointCloudToPCD::cloud_topic_ |
Definition at line 79 of file pointcloud_to_pcd.cpp.
|
private |
Definition at line 73 of file pointcloud_to_pcd.cpp.
|
private |
Definition at line 74 of file pointcloud_to_pcd.cpp.
|
protected |
Definition at line 68 of file pointcloud_to_pcd.cpp.
|
private |
Definition at line 71 of file pointcloud_to_pcd.cpp.
ros::Subscriber PointCloudToPCD::sub_ |
Definition at line 81 of file pointcloud_to_pcd.cpp.
|
private |
Definition at line 75 of file pointcloud_to_pcd.cpp.
|
private |
Definition at line 76 of file pointcloud_to_pcd.cpp.