Holds the state of the exploration. More...
#include <exploration.h>
| Public Member Functions | |
| Explorer (const ExplorerParams ¶ms) | |
| Constructor. | |
| geometry_msgs::Pose | nextNavGoal () | 
| Get the next nav goal to pursue. | |
| void | updateOccupancyGrid (const nav_msgs::OccupancyGrid &grid) | 
| Set the current occupancy grid. | |
| Private Attributes | |
| nav_msgs::OccupancyGrid::ConstPtr | inflated_grid_ | 
| const ExplorerParams | params_ | 
Holds the state of the exploration.
Definition at line 57 of file exploration.h.
| explore_2d::Explorer::Explorer | ( | const ExplorerParams & | params | ) | 
Constructor.
Definition at line 48 of file exploration.cpp.
| gm::Pose explore_2d::Explorer::nextNavGoal | ( | ) | 
Get the next nav goal to pursue.
Definition at line 61 of file exploration.cpp.
| void explore_2d::Explorer::updateOccupancyGrid | ( | const nav_msgs::OccupancyGrid & | grid | ) | 
Set the current occupancy grid.
| nav_msgs::OccupancyGrid::ConstPtr explore_2d::Explorer::inflated_grid_  [private] | 
Definition at line 75 of file exploration.h.
| const ExplorerParams explore_2d::Explorer::params_  [private] | 
Definition at line 73 of file exploration.h.