Public Member Functions | |
void | loadCb (string name, sensor_msgs::LaserScan *scan, ros::Time t, ros::Time t_no_use, void *n) |
void | loadData (LoadType load, char *file) |
void | save (char *file) |
void | test () |
void | train () |
TrainLegDetector () | |
Public Attributes | |
float | connected_thresh_ |
int | feat_count_ |
CvRTrees | forest |
ScanMask | mask_ |
int | mask_count_ |
vector< vector< float > > | neg_data_ |
vector< vector< float > > | pos_data_ |
vector< vector< float > > | test_data_ |
Definition at line 51 of file train_leg_detector.cpp.
TrainLegDetector::TrainLegDetector | ( | ) | [inline] |
Definition at line 67 of file train_leg_detector.cpp.
void TrainLegDetector::loadCb | ( | string | name, |
sensor_msgs::LaserScan * | scan, | ||
ros::Time | t, | ||
ros::Time | t_no_use, | ||
void * | n | ||
) | [inline] |
Definition at line 115 of file train_leg_detector.cpp.
void TrainLegDetector::loadData | ( | LoadType | load, |
char * | file | ||
) | [inline] |
Definition at line 71 of file train_leg_detector.cpp.
void TrainLegDetector::save | ( | char * | file | ) | [inline] |
Definition at line 240 of file train_leg_detector.cpp.
void TrainLegDetector::test | ( | ) | [inline] |
Definition at line 189 of file train_leg_detector.cpp.
void TrainLegDetector::train | ( | ) | [inline] |
Definition at line 136 of file train_leg_detector.cpp.
Definition at line 63 of file train_leg_detector.cpp.
Definition at line 65 of file train_leg_detector.cpp.
CvRTrees TrainLegDetector::forest |
Definition at line 61 of file train_leg_detector.cpp.
Definition at line 54 of file train_leg_detector.cpp.
Definition at line 55 of file train_leg_detector.cpp.
vector< vector<float> > TrainLegDetector::neg_data_ |
Definition at line 58 of file train_leg_detector.cpp.
vector< vector<float> > TrainLegDetector::pos_data_ |
Definition at line 57 of file train_leg_detector.cpp.
vector< vector<float> > TrainLegDetector::test_data_ |
Definition at line 59 of file train_leg_detector.cpp.