Definition at line 447 of file leg_detector.cpp.
LegDetector::LegDetector | ( | ros::NodeHandle | nh | ) | [inline] |
Definition at line 485 of file leg_detector.cpp.
LegDetector::~LegDetector | ( | ) | [inline] |
Definition at line 523 of file leg_detector.cpp.
void LegDetector::configure | ( | cob_leg_detection::LegDetectionConfig & | config, |
uint32_t | level | ||
) | [inline] |
Definition at line 527 of file leg_detector.cpp.
double LegDetector::distance | ( | list< SavedFeature * >::iterator | it1, |
list< SavedFeature * >::iterator | it2 | ||
) | [inline] |
Definition at line 1044 of file leg_detector.cpp.
void LegDetector::laserCallback | ( | const sensor_msgs::LaserScan::ConstPtr & | scan | ) | [inline] |
Definition at line 706 of file leg_detector.cpp.
void LegDetector::pairLegs | ( | ) | [inline] |
Definition at line 1062 of file leg_detector.cpp.
void LegDetector::peopleCallback | ( | const cob_perception_msgs::PositionMeasurementArray::ConstPtr & | people_meas | ) | [inline] |
Definition at line 563 of file leg_detector.cpp.
void LegDetector::PRINT_LIST | ( | list< SavedPersonFeature * > & | coll, |
const char * | optcstr = "" |
||
) | [inline] |
Definition at line 1052 of file leg_detector.cpp.
Definition at line 483 of file leg_detector.cpp.
Definition at line 456 of file leg_detector.cpp.
Definition at line 457 of file leg_detector.cpp.
Definition at line 461 of file leg_detector.cpp.
CvRTrees LegDetector::forest |
Definition at line 455 of file leg_detector.cpp.
tf::MessageFilter<sensor_msgs::LaserScan> LegDetector::laser_notifier_ |
Definition at line 478 of file leg_detector.cpp.
message_filters::Subscriber<sensor_msgs::LaserScan> LegDetector::laser_sub_ |
Definition at line 476 of file leg_detector.cpp.
Definition at line 469 of file leg_detector.cpp.
Definition at line 465 of file leg_detector.cpp.
Definition at line 471 of file leg_detector.cpp.
Definition at line 453 of file leg_detector.cpp.
Definition at line 454 of file leg_detector.cpp.
Definition at line 466 of file leg_detector.cpp.
Definition at line 464 of file leg_detector.cpp.
Definition at line 450 of file leg_detector.cpp.
Definition at line 468 of file leg_detector.cpp.
Definition at line 470 of file leg_detector.cpp.
message_filters::Subscriber<cob_perception_msgs::PositionMeasurementArray> LegDetector::people_sub_ |
Definition at line 475 of file leg_detector.cpp.
Definition at line 463 of file leg_detector.cpp.
Definition at line 463 of file leg_detector.cpp.
Definition at line 463 of file leg_detector.cpp.
Definition at line 463 of file leg_detector.cpp.
Definition at line 463 of file leg_detector.cpp.
char LegDetector::save_[100] |
Definition at line 458 of file leg_detector.cpp.
Definition at line 459 of file leg_detector.cpp.
boost::mutex LegDetector::saved_mutex_ |
Definition at line 460 of file leg_detector.cpp.
Definition at line 481 of file leg_detector.cpp.
dynamic_reconfigure::Server<cob_leg_detection::LegDetectionConfig> LegDetector::server_ |
Definition at line 473 of file leg_detector.cpp.
Definition at line 451 of file leg_detector.cpp.
Definition at line 462 of file leg_detector.cpp.