#include <nav_msgs/OccupancyGrid.h>
#include <geometry_msgs/Pose.h>
#include <visualization_msgs/MarkerArray.h>
#include <tf/LinearMath/Vector3.h>
#include <explore/costmap_client.h>
#include <explore/navfn_ros.h>
Go to the source code of this file.
Classes | |
class | explore::ExploreFrontier |
A class that will identify frontiers in a partially explored map. More... | |
struct | explore::Frontier |
struct | explore::FrontierPoint |
struct | explore::WeightedFrontier |
Namespaces | |
namespace | explore |