Public Member Functions | Private Attributes
topological_tools::TopologicalNode Class Reference

#include <topological_node.h>

List of all members.

Public Member Functions

void connect (boost::shared_ptr< TopologicalNode > tpn, const std::string &connection_label)
boost::shared_ptr
< TopologicalNode
getConnection (const std::string &connection_label)
const geometry_msgs::Pose & getGoalPose ()
const std::string & getName ()
bool hasConnection (const std::string &connection_label)
 TopologicalNode (const geometry_msgs::Pose &goal, const std::string &name)

Private Attributes

std::map< std::string,
boost::shared_ptr
< TopologicalNode > > 
connections_
geometry_msgs::Pose goal_
std::string name_

Detailed Description

Definition at line 38 of file topological_node.h.


Constructor & Destructor Documentation

TopologicalNode::TopologicalNode ( const geometry_msgs::Pose &  goal,
const std::string &  name 
)

Definition at line 37 of file topological_node.cpp.


Member Function Documentation

void TopologicalNode::connect ( boost::shared_ptr< TopologicalNode tpn,
const std::string &  connection_label 
)

Definition at line 44 of file topological_node.cpp.

boost::shared_ptr< TopologicalNode > TopologicalNode::getConnection ( const std::string &  connection_label)

Definition at line 51 of file topological_node.cpp.

const geometry_msgs::Pose & TopologicalNode::getGoalPose ( )

Definition at line 71 of file topological_node.cpp.

const string & TopologicalNode::getName ( )

Definition at line 78 of file topological_node.cpp.

bool TopologicalNode::hasConnection ( const std::string &  connection_label)

Definition at line 64 of file topological_node.cpp.


Member Data Documentation

std::map<std::string, boost::shared_ptr<TopologicalNode> > topological_tools::TopologicalNode::connections_ [private]

Definition at line 54 of file topological_node.h.

geometry_msgs::Pose topological_tools::TopologicalNode::goal_ [private]

Definition at line 51 of file topological_node.h.

Definition at line 52 of file topological_node.h.


The documentation for this class was generated from the following files:


topological_tools
Author(s): Joao Messias
autogenerated on Wed Aug 26 2015 12:28:47