#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 <list>
#include <set>
#include <string>
#include <vector>
Go to the source code of this file.
|
int | main (int argc, char **argv) |
|
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
std::string fixed_frame = "odom_combined" |
|
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 |