Maintains a history of laser scans and generates a point cloud upon request.
More...
|
void | ConvertToCloud (const string &fixed_frame_id, const sensor_msgs::LaserScan &scan_in, sensor_msgs::PointCloud &cloud_out) |
|
unsigned int | GetPointsInScan (const sensor_msgs::LaserScan &scan) |
| Returns the number of points in the current scan. More...
|
|
| LaserScanAssembler () |
|
void | scanCallback (const sensor_msgs::LaserScanConstPtr &laser_scan) |
|
| ~LaserScanAssembler () |
|
| BaseAssembler (const std::string &max_size_param_name) |
|
virtual void | ConvertToCloud (const std::string &fixed_frame_id, const sensor_msgs::LaserScan &scan_in, sensor_msgs::PointCloud &cloud_out)=0 |
| Converts the current scan into a cloud in the specified fixed frame. More...
|
|
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 initialize and configure various things before actually beginning to process scans. Calling start create subcribes to the input stream, thus allowing the scanCallback and ConvertToCloud to be called. Start should be called only once. More...
|
|
void | start () |
|
| ~BaseAssembler () |
|
Maintains a history of laser scans and generates a point cloud upon request.
Definition at line 50 of file laser_scan_assembler.cpp.
laser_assembler::LaserScanAssembler::LaserScanAssembler |
( |
| ) |
|
|
inline |
laser_assembler::LaserScanAssembler::~LaserScanAssembler |
( |
| ) |
|
|
inline |
void laser_assembler::LaserScanAssembler::ConvertToCloud |
( |
const string & |
fixed_frame_id, |
|
|
const sensor_msgs::LaserScan & |
scan_in, |
|
|
sensor_msgs::PointCloud & |
cloud_out |
|
) |
| |
|
inline |
unsigned int laser_assembler::LaserScanAssembler::GetPointsInScan |
( |
const sensor_msgs::LaserScan & |
scan | ) |
|
|
inlinevirtual |
void laser_assembler::LaserScanAssembler::scanCallback |
( |
const sensor_msgs::LaserScanConstPtr & |
laser_scan | ) |
|
|
inline |
bool laser_assembler::LaserScanAssembler::ignore_laser_skew_ |
|
private |
ros::Duration laser_assembler::LaserScanAssembler::max_tolerance_ |
|
private |
sensor_msgs::LaserScan laser_assembler::LaserScanAssembler::scan_filtered_ |
|
mutableprivate |
The documentation for this class was generated from the following file: