Public Member Functions | Public Attributes | List of all members
TrainLegDetector Class Reference

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_
 

Detailed Description

Definition at line 51 of file train_leg_detector.cpp.

Constructor & Destructor Documentation

TrainLegDetector::TrainLegDetector ( )
inline

Definition at line 67 of file train_leg_detector.cpp.

Member Function Documentation

void TrainLegDetector::loadCb ( string  name,
sensor_msgs::LaserScan *  scan,
ros::Time  t,
ros::Time  t_no_use,
void *  n 
)
inline

Definition at line 118 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 243 of file train_leg_detector.cpp.

void TrainLegDetector::test ( )
inline

Definition at line 192 of file train_leg_detector.cpp.

void TrainLegDetector::train ( )
inline

Definition at line 139 of file train_leg_detector.cpp.

Member Data Documentation

float TrainLegDetector::connected_thresh_

Definition at line 63 of file train_leg_detector.cpp.

int TrainLegDetector::feat_count_

Definition at line 65 of file train_leg_detector.cpp.

CvRTrees TrainLegDetector::forest

Definition at line 61 of file train_leg_detector.cpp.

ScanMask TrainLegDetector::mask_

Definition at line 54 of file train_leg_detector.cpp.

int TrainLegDetector::mask_count_

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.


The documentation for this class was generated from the following file:


leg_detector
Author(s): Caroline Pantofaru
autogenerated on Fri Jun 7 2019 22:07:52