#include <topological_map_2d/topological_map.h>
#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>
#include <topological_nav_msgs/RoadmapNode.h>
#include <topological_nav_msgs/RoadmapEdge.h>
Go to the source code of this file.
Classes | |
class | topological_roadmap::Roadmap |
Namespaces | |
namespace | topological_roadmap |
Typedefs | |
typedef boost::adjacency_list < boost::multisetS, boost::listS, boost::undirectedS, msg::RoadmapNode, msg::RoadmapEdge > | topological_roadmap::Graph |
typedef boost::graph_traits < Graph >::edge_descriptor | topological_roadmap::GraphEdge |
typedef boost::graph_traits < Graph >::vertex_descriptor | topological_roadmap::GraphVertex |
Functions | |
std::pair< std::vector < unsigned >, std::vector < geometry_msgs::Point > > | topological_roadmap::nodesOnGrid (const unsigned g, const Roadmap &r, const topological_map_2d::TopologicalMap &t) |
geometry_msgs::Point | topological_roadmap::positionOnGrid (unsigned n, unsigned g, const Roadmap &r, const topological_map_2d::TopologicalMap &t) |
Defines the Roadmap class
Definition in file roadmap.h.