$search
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 93 of file laser_processor.h.
laser_processor::SampleSet::SampleSet | ( | ) | [inline] |
Definition at line 96 of file laser_processor.h.
laser_processor::SampleSet::~SampleSet | ( | ) | [inline] |
Definition at line 98 of file laser_processor.h.
void 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 SampleSet::center | ( | ) |
Definition at line 94 of file laser_processor.cpp.
void SampleSet::clear | ( | void | ) |
Definition at line 60 of file laser_processor.cpp.