#include <opencv2/core/core.hpp>
#include <opencv2/imgproc/imgproc.hpp>
#include <nav_msgs/OccupancyGrid.h>
Go to the source code of this file.
Classes | |
class | gridmap_2d::GridMap2D |
Stores a nav_msgs::OccupancyGrid in a convenient opencv cv::Mat as binary map (free: 255, occupied: 0) and as distance map (distance to closest obstacle in meter). More... | |
Namespaces | |
namespace | gridmap_2d |
Typedefs | |
typedef boost::shared_ptr < GridMap2D > | gridmap_2d::GridMap2DPtr |