#include "cob_leg_detection/laser_processor.h"
#include "cob_leg_detection/calc_leg_features.h"
#include <opencv2/opencv.hpp>
#include "cob_perception_msgs/PositionMeasurement.h"
#include "sensor_msgs/LaserScan.h"
Go to the source code of this file.
Classes | |
class | TrainLegDetector |
Enumerations | |
enum | LoadType { LOADING_NONE, LOADING_POS, LOADING_NEG, LOADING_TEST } |
Functions | |
int | main (int argc, char **argv) |
enum LoadType |
Definition at line 47 of file train_leg_detector.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 244 of file train_leg_detector.cpp.