Classes | Functions | Variables
leg_detector.cpp File Reference
#include <ros/ros.h>
#include <leg_detector/LegDetectorConfig.h>
#include <leg_detector/laser_processor.h>
#include <leg_detector/calc_leg_features.h>
#include <opencv/cxcore.h>
#include <opencv/cv.h>
#include <opencv/ml.h>
#include <people_msgs/PositionMeasurement.h>
#include <people_msgs/PositionMeasurementArray.h>
#include <sensor_msgs/LaserScan.h>
#include <tf/transform_listener.h>
#include <tf/message_filter.h>
#include <message_filters/subscriber.h>
#include <people_tracking_filter/tracker_kalman.h>
#include <people_tracking_filter/state_pos_vel.h>
#include <people_tracking_filter/rgb.h>
#include <visualization_msgs/Marker.h>
#include <dynamic_reconfigure/server.h>
#include <algorithm>
Include dependency graph for leg_detector.cpp:

Go to the source code of this file.

Classes

class  LegDetector
class  MatchedFeature
class  SavedFeature

Functions

int main (int argc, char **argv)

Variables

static string fixed_frame = "odom_combined"
int g_argc
char ** g_argv
static double kal_p = 4
static double kal_q = .002
static double kal_r = 10
static double leg_pair_separation_m = 1.0
static double max_meas_jump_m = 0.75
static double max_second_leg_age_s = 2.0
static double max_track_jump_m = 1.0
static double no_observation_timeout_s = 0.5
static bool use_filter = true

Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 989 of file leg_detector.cpp.


Variable Documentation

string fixed_frame = "odom_combined" [static]

Definition at line 74 of file leg_detector.cpp.

int g_argc

Definition at line 229 of file leg_detector.cpp.

char** g_argv

Definition at line 230 of file leg_detector.cpp.

double kal_p = 4 [static]

Definition at line 76 of file leg_detector.cpp.

double kal_q = .002 [static]

Definition at line 76 of file leg_detector.cpp.

double kal_r = 10 [static]

Definition at line 76 of file leg_detector.cpp.

double leg_pair_separation_m = 1.0 [static]

Definition at line 73 of file leg_detector.cpp.

double max_meas_jump_m = 0.75 [static]

Definition at line 72 of file leg_detector.cpp.

double max_second_leg_age_s = 2.0 [static]

Definition at line 70 of file leg_detector.cpp.

double max_track_jump_m = 1.0 [static]

Definition at line 71 of file leg_detector.cpp.

double no_observation_timeout_s = 0.5 [static]

Definition at line 69 of file leg_detector.cpp.

bool use_filter = true [static]

Definition at line 77 of file leg_detector.cpp.



leg_detector
Author(s): Caroline Pantofaru
autogenerated on Thu Apr 13 2017 02:41:52