Namespaces | Functions
costmap_tools.h File Reference
#include <geometry_msgs/PolygonStamped.h>
#include <geometry_msgs/PointStamped.h>
#include <costmap_2d/costmap_2d.h>
#include <boost/foreach.hpp>
#include <ros/ros.h>
Include dependency graph for costmap_tools.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Namespaces

 frontier_exploration
 

Functions

bool frontier_exploration::nearestCell (unsigned int &result, unsigned int start, unsigned char val, const costmap_2d::Costmap2D &costmap)
 Find nearest cell of a specified value. More...
 
std::vector< unsigned int > frontier_exploration::nhood4 (unsigned int idx, const costmap_2d::Costmap2D &costmap)
 Determine 4-connected neighbourhood of an input cell, checking for map edges. More...
 
std::vector< unsigned int > frontier_exploration::nhood8 (unsigned int idx, const costmap_2d::Costmap2D &costmap)
 Determine 8-connected neighbourhood of an input cell, checking for map edges. More...
 


frontier_exploration
Author(s): Paul Bovbel
autogenerated on Mon Jun 10 2019 13:25:00