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 () | |
Public Attributes | |
std_msgs::Header | header |
An ordered set of Samples.
Definition at line 84 of file laser_processor.h.
|
inline |
Definition at line 87 of file laser_processor.h.
|
inline |
Definition at line 89 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 71 of file laser_processor.cpp.
tf::Point laser_processor::SampleSet::center | ( | ) |
Definition at line 94 of file laser_processor.cpp.
void laser_processor::SampleSet::clear | ( | ) |
Definition at line 60 of file laser_processor.cpp.
std_msgs::Header laser_processor::SampleSet::header |
Definition at line 99 of file laser_processor.h.