Maintains a history of incremental point clouds (usually from laser scans) and generates a point cloud upon request. More...
Public Member Functions | |
void | ConvertToCloud (const string &fixed_frame_id, const sensor_msgs::PointCloud2 &scan_in, sensor_msgs::PointCloud &cloud_out) |
unsigned int | GetPointsInScan (const sensor_msgs::PointCloud2 &scan) |
Returns the number of points in the current scan. | |
PointCloud2Assembler () | |
~PointCloud2Assembler () |
Maintains a history of incremental point clouds (usually from laser scans) and generates a point cloud upon request.
Definition at line 50 of file point_cloud2_assembler.cpp.
Definition at line 53 of file point_cloud2_assembler.cpp.
Definition at line 58 of file point_cloud2_assembler.cpp.
void laser_assembler::PointCloud2Assembler::ConvertToCloud | ( | const string & | fixed_frame_id, |
const sensor_msgs::PointCloud2 & | scan_in, | ||
sensor_msgs::PointCloud & | cloud_out | ||
) | [inline] |
Definition at line 68 of file point_cloud2_assembler.cpp.
unsigned int laser_assembler::PointCloud2Assembler::GetPointsInScan | ( | const sensor_msgs::PointCloud2 & | scan | ) | [inline, virtual] |
Returns the number of points in the current scan.
scan | The scan for for which we want to know the number of points |
Implements laser_assembler::BaseAssembler< sensor_msgs::PointCloud2 >.
Definition at line 63 of file point_cloud2_assembler.cpp.