#include <topological_nav_msgs/TopologicalMapNode.h>
#include <topological_nav_msgs/TopologicalMapEdge.h>
#include <map>
#include <boost/graph/adjacency_list.hpp>
#include <boost/graph/graph_traits.hpp>
Go to the source code of this file.
Classes | |
class | topological_map_2d::TopologicalMap |
Namespaces | |
namespace | topological_map_2d |
Defines | |
#define | BOOST_NO_HASH |
Typedefs | |
typedef boost::adjacency_list < boost::listS, boost::listS, boost::undirectedS, msg::TopologicalMapNode, msg::TopologicalMapEdge > | topological_map_2d::Graph |
typedef boost::graph_traits < Graph >::edge_descriptor | topological_map_2d::GraphEdge |
typedef boost::graph_traits < Graph >::vertex_descriptor | topological_map_2d::GraphVertex |
Functions | |
unsigned | topological_map_2d::frameGrid (const std::string &frame) |
std::string | topological_map_2d::gridFrame (const unsigned g) |
Defines the TopologicalMap class, which represents a set of overlapping local occupancy grids
Definition in file topological_map.h.
#define BOOST_NO_HASH |
Definition at line 47 of file topological_map.h.