#include <topological_map.h>
Public Member Functions | |
void | addNode (geometry_msgs::Pose goal, const std::string &node_name) |
boost::shared_ptr < TopologicalNode > | getNodeByName (const std::string &node_name) |
bool | hasNode (const std::string &node_name) |
TopologicalMap (const std::string &map_file) | |
Private Attributes | |
std::map< std::string, boost::shared_ptr < TopologicalNode > > | node_map_ |
Definition at line 35 of file topological_map.h.
TopologicalMap::TopologicalMap | ( | const std::string & | map_file | ) |
Definition at line 42 of file topological_map.cpp.
void TopologicalMap::addNode | ( | geometry_msgs::Pose | goal, |
const std::string & | node_name | ||
) |
Definition at line 106 of file topological_map.cpp.
boost::shared_ptr< TopologicalNode > TopologicalMap::getNodeByName | ( | const std::string & | node_name | ) |
Definition at line 93 of file topological_map.cpp.
bool TopologicalMap::hasNode | ( | const std::string & | node_name | ) |
Definition at line 86 of file topological_map.cpp.
std::map<std::string, boost::shared_ptr<TopologicalNode> > topological_tools::TopologicalMap::node_map_ [private] |
Definition at line 48 of file topological_map.h.