1 #ifndef FRONTIER_SEARCH_H_ 2 #define FRONTIER_SEARCH_H_ 19 std::vector<geometry_msgs::Point>
points;
38 double gain_scale,
double min_frontier_size);
45 std::vector<Frontier> searchFrom(geometry_msgs::Point position);
57 Frontier buildNewFrontier(
unsigned int initial_cell,
unsigned int reference,
58 std::vector<bool>& frontier_flag);
68 bool isNewFrontierCell(
unsigned int idx,
69 const std::vector<bool>& frontier_flag);
78 double frontierCost(
const Frontier& frontier);
geometry_msgs::Point centroid
geometry_msgs::Point initial
double min_frontier_size_
std::vector< geometry_msgs::Point > points
Thread-safe implementation of a frontier-search task for an input costmap.
costmap_2d::Costmap2D * costmap_
geometry_msgs::Point middle