#include <nav2d_operator/cmd.h>
#include <nav_msgs/GridCells.h>
#include <visualization_msgs/Marker.h>
#include <nav2d_navigator/RobotNavigator.h>
#include <nav2d_navigator/ExplorationPlanner.h>
#include <set>
#include <map>
Go to the source code of this file.
Defines | |
#define | FREQUENCY 5.0 |
#define | PI 3.14159265 |
Typedefs | |
typedef std::pair< double, unsigned int > | Entry |
typedef std::multimap< double, unsigned int > | Queue |
#define FREQUENCY 5.0 |
Definition at line 12 of file RobotNavigator.cpp.
#define PI 3.14159265 |
Definition at line 11 of file RobotNavigator.cpp.
typedef std::pair<double,unsigned int> Entry |
Definition at line 171 of file RobotNavigator.cpp.
typedef std::multimap<double,unsigned int> Queue |
Definition at line 170 of file RobotNavigator.cpp.