Represents a frontier. More...
#include <frontier_search.h>
Public Attributes | |
| geometry_msgs::Point | centroid |
| double | cost |
| geometry_msgs::Point | initial |
| geometry_msgs::Point | middle |
| double | min_distance |
| std::vector< geometry_msgs::Point > | points |
| std::uint32_t | size |
Represents a frontier.
Definition at line 12 of file frontier_search.h.
| geometry_msgs::Point frontier_exploration::Frontier::centroid |
Definition at line 17 of file frontier_search.h.
| double frontier_exploration::Frontier::cost |
Definition at line 15 of file frontier_search.h.
| geometry_msgs::Point frontier_exploration::Frontier::initial |
Definition at line 16 of file frontier_search.h.
| geometry_msgs::Point frontier_exploration::Frontier::middle |
Definition at line 18 of file frontier_search.h.
| double frontier_exploration::Frontier::min_distance |
Definition at line 14 of file frontier_search.h.
| std::vector<geometry_msgs::Point> frontier_exploration::Frontier::points |
Definition at line 19 of file frontier_search.h.
| std::uint32_t frontier_exploration::Frontier::size |
Definition at line 13 of file frontier_search.h.