#include "ros/ros.h"#include "ExplorationPlanner.h"#include <ros/console.h>#include <boost/lexical_cast.hpp>#include <move_base/MoveBaseConfig.h>#include <move_base_msgs/MoveBaseAction.h>#include <move_base_msgs/MoveBaseActionFeedback.h>#include <costmap_2d/costmap_2d_ros.h>#include <costmap_2d/costmap_2d.h>#include <costmap_2d/cost_values.h>#include <costmap_2d/costmap_2d_publisher.h>#include <costmap_2d/observation.h>#include <costmap_2d/observation_buffer.h>#include <tf/transform_listener.h>#include <std_msgs/String.h>#include <actionlib/client/simple_action_client.h>#include <boost/thread.hpp>#include <boost/thread/mutex.hpp>#include <iostream>#include <navfn/navfn_ros.h>#include <boost/filesystem.hpp>#include <map_merger/LogMaps.h>
Go to the source code of this file.
Classes | |
| class | Explorer |
| struct | Explorer::map_progress_t |
Defines | |
| #define | OPERATE_ON_GLOBAL_MAP true |
| #define | OPERATE_WITH_GOAL_BACKOFF false |
Functions | |
| int | main (int argc, char **argv) |
| void | sleepok (int t, ros::NodeHandle &nh) |
Variables | |
| boost::mutex | costmap_mutex |
| #define OPERATE_ON_GLOBAL_MAP true |
Definition at line 36 of file explorer.cpp.
| #define OPERATE_WITH_GOAL_BACKOFF false |
Definition at line 37 of file explorer.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 1653 of file explorer.cpp.
| void sleepok | ( | int | t, |
| ros::NodeHandle & | nh | ||
| ) |
Definition at line 39 of file explorer.cpp.
| boost::mutex costmap_mutex |
Definition at line 34 of file explorer.cpp.