$search
#include "calc_leg_features.h"
#include <unistd.h>
#include <math.h>
#include "sensor_msgs/LaserScan.h"
#include "sensor_msgs/PointCloud.h"
#include "geometry_msgs/Point.h"
#include <list>
#include <set>
#include <vector>
#include <map>
#include <utility>
#include <algorithm>
#include "tf/transform_datatypes.h"
#include "opencv/cxcore.h"
#include "opencv/cv.h"
Go to the source code of this file.
Functions | |
vector< float > | calcLegFeatures (SampleSet *cluster, const sensor_msgs::LaserScan &scan) |
vector<float> calcLegFeatures | ( | SampleSet * | cluster, | |
const sensor_msgs::LaserScan & | scan | |||
) |
Definition at line 43 of file calc_leg_features.cpp.