#include <explore/explore.h>#include <ros/ros.h>#include <move_base_msgs/MoveBaseAction.h>#include <actionlib/client/simple_action_client.h>#include <geometry_msgs/PoseStamped.h>#include <nav_msgs/GetMap.h>#include <costmap_2d/costmap_2d_ros.h>#include <costmap_2d/costmap_2d.h>#include <navfn/navfn_ros.h>#include <explore/explore_frontier.h>#include <explore/loop_closure.h>#include <visualization_msgs/MarkerArray.h>#include <vector>#include <string>#include <boost/thread/mutex.hpp>#include <boost/thread.hpp>#include <boost/bind.hpp>

Go to the source code of this file.
Namespaces | |
| namespace | explore |
Functions | |
| int | main (int argc, char **argv) |
| double | explore::sign (double x) |
| int main | ( | int | argc, | |
| char ** | argv | |||
| ) |
Definition at line 349 of file explore.cpp.