An ordered set of Samples. More...
#include <laser_processor.h>

Public Member Functions | |
| void | appendToCloud (sensor_msgs::PointCloud &cloud, int r=0, int g=0, int b=0) |
| tf::Point | center () |
| void | clear () |
| SampleSet () | |
| ~SampleSet () | |
An ordered set of Samples.
Definition at line 116 of file laser_processor.h.
|
inline |
Definition at line 119 of file laser_processor.h.
|
inline |
Definition at line 121 of file laser_processor.h.
| void laser_processor::SampleSet::appendToCloud | ( | sensor_msgs::PointCloud & | cloud, |
| int | r = 0, |
||
| int | g = 0, |
||
| int | b = 0 |
||
| ) |
Definition at line 104 of file laser_processor.cpp.
| tf::Point laser_processor::SampleSet::center | ( | ) |
Definition at line 127 of file laser_processor.cpp.
| void laser_processor::SampleSet::clear | ( | ) |
Definition at line 93 of file laser_processor.cpp.