#include <ros/ros.h>
#include <costmap_converter/costmap_converter_interface.h>
#include <nav_msgs/OccupancyGrid.h>
#include <visualization_msgs/Marker.h>
#include <geometry_msgs/Point.h>
#include <geometry_msgs/Polygon.h>
#include <vector>
#include <algorithm>
#include <Eigen/Core>
#include <Eigen/StdVector>
#include <boost/thread/mutex.hpp>
#include <boost/thread/thread.hpp>
#include <costmap_converter/CostmapToPolygonsDBSMCCHConfig.h>
#include <dynamic_reconfigure/server.h>
Go to the source code of this file.