#include <dynamic_obs_msgs/DynamicObstacles.h>
#include <string>
#include <vector>
#include <ostream>
#include "ros/serialization.h"
#include "ros/builtin_message_traits.h"
#include "ros/message_operations.h"
#include "ros/message.h"
#include "ros/time.h"
#include "std_msgs/Header.h"
#include "geometry_msgs/Pose.h"
#include <dynamic_obs_msgs/DynamicObstacle.h>
#include <dynamic_obs_msgs/DynObsTrajectory.h>
#include <geometry_msgs/PoseWithCovarianceStamped.h>
#include <ros/ros.h>
#include <stdio.h>
#include <lidar_tracking/lidarTracking.h>
#include "geometry_msgs/Vector3.h"
#include "geometry_msgs/Point.h"
#include "std_msgs/ColorRGBA.h"
#include "visualization_msgs/Marker.h"
Go to the source code of this file.
Defines | |
#define | CLUSTER_MAX_ANGLE_DIFF (90*M_PI/180) |
#define | CLUSTER_MIN_VELOCITY 0.2 |
#define | CLUSTER_TIMEOUT 15.0 |
#define | CLUSTER_TOO_FAR 0.4 |
#define | DYN_OBS_COUNT_THRESH 40 |
#define | MAP_PADDING 0.1 |
#define | MAX(a, b) (a > b ? a : b) |
#define | MAX_COUNT 1600 |
#define | MAX_POINTS 100 |
#define | MAX_RADIUS_CHANGE 0.1 |
#define | MAX_TURNING 0.1 |
#define | MIN_COUNT 0 |
#define | VISUALIZE_DYNAMIC_OBSTACLES 1 |
#define | VISUALIZE_OBSTACLE_TRAILS 1 |
Functions | |
int | main (int argc, char **argv) |
#define CLUSTER_MAX_ANGLE_DIFF (90*M_PI/180) |
Definition at line 27 of file lidarTracking.cpp.
#define CLUSTER_MIN_VELOCITY 0.2 |
Definition at line 26 of file lidarTracking.cpp.
#define CLUSTER_TIMEOUT 15.0 |
Definition at line 24 of file lidarTracking.cpp.
#define CLUSTER_TOO_FAR 0.4 |
Definition at line 25 of file lidarTracking.cpp.
#define DYN_OBS_COUNT_THRESH 40 |
Definition at line 22 of file lidarTracking.cpp.
#define MAP_PADDING 0.1 |
Definition at line 31 of file lidarTracking.cpp.
#define MAX | ( | a, | |||
b | ) | (a > b ? a : b) |
Definition at line 35 of file lidarTracking.cpp.
#define MAX_COUNT 1600 |
Definition at line 20 of file lidarTracking.cpp.
#define MAX_POINTS 100 |
Definition at line 30 of file lidarTracking.cpp.
#define MAX_RADIUS_CHANGE 0.1 |
Definition at line 28 of file lidarTracking.cpp.
#define MAX_TURNING 0.1 |
Definition at line 33 of file lidarTracking.cpp.
#define MIN_COUNT 0 |
Definition at line 21 of file lidarTracking.cpp.
#define VISUALIZE_DYNAMIC_OBSTACLES 1 |
Definition at line 17 of file lidarTracking.cpp.
#define VISUALIZE_OBSTACLE_TRAILS 1 |
Definition at line 18 of file lidarTracking.cpp.
int main | ( | int | argc, | |
char ** | argv | |||
) |
Definition at line 502 of file lidarTracking.cpp.