#include "ros/ros.h"
#include "laser_processor.h"
#include "calc_leg_features.h"
#include "opencv/cxcore.h"
#include "opencv/cv.h"
#include "opencv/ml.h"
#include "srs_msgs/PositionMeasurement.h"
#include "srs_msgs/HS_distance.h"
#include "sensor_msgs/LaserScan.h"
#include "std_msgs/Header.h"
#include "tf/transform_listener.h"
#include "tf/message_filter.h"
#include "message_filters/subscriber.h"
#include "srs_people_tracking_filter/tracker_kalman.h"
#include "srs_people_tracking_filter/gaussian_pos_vel.h"
#include "srs_people_tracking_filter/state_pos_vel.h"
#include "srs_people_tracking_filter/rgb.h"
#include <algorithm>
#include "nav_msgs/OccupancyGrid.h"
#include "nav_msgs/GetMap.h"
#include <srs_leg_detector/DetectLegs.h>
Go to the source code of this file.
Classes | |
class | LegDetector |
class | Legs |
class | MatchedFeature |
class | Pair |
class | SavedFeature |
Functions | |
int | main (int argc, char **argv) |
Variables | |
static const double | det_dist__for_pause = 0.5 |
static const double | det_dist__for_resume = 2.5 |
static const string | fixed_frame = "/map" |
int | g_argc |
char ** | g_argv |
static const double | leg_pair_separation_m = 0.5 |
static const double | max_meas_jump_m = 1 |
static const double | max_second_leg_age_s = 2.0 |
static const double | max_track_jump_m = 1 |
static const double | no_observation_timeout_s = 0.7 |
string | scan_topic = "scan_front" |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 927 of file srs_leg_detector.cpp.
const double det_dist__for_pause = 0.5 [static] |
Definition at line 63 of file srs_leg_detector.cpp.
const double det_dist__for_resume = 2.5 [static] |
Definition at line 64 of file srs_leg_detector.cpp.
const string fixed_frame = "/map" [static] |
Definition at line 61 of file srs_leg_detector.cpp.
int g_argc |
Definition at line 221 of file srs_leg_detector.cpp.
char** g_argv |
Definition at line 222 of file srs_leg_detector.cpp.
const double leg_pair_separation_m = 0.5 [static] |
Definition at line 59 of file srs_leg_detector.cpp.
const double max_meas_jump_m = 1 [static] |
Definition at line 58 of file srs_leg_detector.cpp.
const double max_second_leg_age_s = 2.0 [static] |
Definition at line 56 of file srs_leg_detector.cpp.
const double max_track_jump_m = 1 [static] |
Definition at line 57 of file srs_leg_detector.cpp.
const double no_observation_timeout_s = 0.7 [static] |
Definition at line 55 of file srs_leg_detector.cpp.
string scan_topic = "scan_front" |
Definition at line 223 of file srs_leg_detector.cpp.