#include <costmap_converter/costmap_converter_interface.h>
#include <nav_msgs/Odometry.h>
#include <pluginlib/class_loader.h>
#include <ros/ros.h>
#include <cv_bridge/cv_bridge.h>
#include <opencv2/features2d/features2d.hpp>
#include <opencv2/video/tracking.hpp>
#include <costmap_converter/CostmapToDynamicObstaclesConfig.h>
#include <dynamic_reconfigure/server.h>
#include <costmap_converter/costmap_to_dynamic_obstacles/multitarget_tracker/Ctracker.h>
#include <costmap_converter/costmap_to_dynamic_obstacles/background_subtractor.h>
#include <costmap_converter/costmap_to_dynamic_obstacles/blob_detector.h>
#include <memory>
Go to the source code of this file.
Classes | |
class | costmap_converter::CostmapToDynamicObstacles |
This class converts the costmap_2d into dynamic obstacles. More... | |
Namespaces | |
costmap_converter | |