Go to the documentation of this file.
65 return (scan.width * scan.height);
68 void ConvertToCloud(
const string& fixed_frame_id,
const sensor_msgs::PointCloud2& scan_in, sensor_msgs::PointCloud& cloud_out)
70 sensor_msgs::PointCloud cloud_in;
72 tf_->transformPointCloud(fixed_frame_id, cloud_in, cloud_out) ;
84 int main(
int argc,
char **argv)
86 ros::init(argc, argv,
"point_cloud_assembler");
88 pc_assembler.
start(
"cloud");
void ConvertToCloud(const string &fixed_frame_id, const sensor_msgs::PointCloud2 &scan_in, sensor_msgs::PointCloud &cloud_out)
ROSCPP_DECL void init(const M_string &remappings, const std::string &name, uint32_t options=0)
Maintains a history of point clouds and generates an aggregate point cloud upon request.
unsigned int GetPointsInScan(const sensor_msgs::PointCloud2 &scan)
Returns the number of points in the current scan.
void start(const std::string &in_topic_name)
Tells the assembler to start listening to input data It is possible that a derived class needs to ini...
int main(int argc, char **argv)
Maintains a history of incremental point clouds (usually from laser scans) and generates a point clou...
static bool convertPointCloud2ToPointCloud(const sensor_msgs::PointCloud2 &input, sensor_msgs::PointCloud &output)
laser_assembler
Author(s): Vijay Pradeep
autogenerated on Sat Aug 10 2024 02:10:39