voronoi_path_generator.h
Go to the documentation of this file.
1 
2 #ifndef _GENERATOR
3 #define _GENERATOR
4 
5 #include <nav_msgs/OccupancyGrid.h>
6 #include <memory>
7 #include <opencv/cv.h>
8 
9 #define DEFAULT_MAP_NAME "voronoi_map"
10 
11 namespace voronoi_map
12 {
14  {
15  public:
23  void prepareMap(const cv::Mat& _map, cv::Mat& _smoothedMap, int _blurSize);
29  void computeDistanceField(const cv::Mat& _map, cv::Mat& _distField) ;
35  void computeVoronoiMap(const cv::Mat& _distField, cv::Mat& _voronoiMap);
36  };
37 
38 }
39 
40 #endif
void computeVoronoiMap(const cv::Mat &_distField, cv::Mat &_voronoiMap)
computes the voronoi _map
void computeDistanceField(const cv::Mat &_map, cv::Mat &_distField)
computes the distance field of a map
void prepareMap(const cv::Mat &_map, cv::Mat &_smoothedMap, int _blurSize)
prepares the map by smoothing it


tuw_voronoi_graph
Author(s): Benjamin Binder
autogenerated on Mon Jun 10 2019 15:42:44