Public Member Functions | Private Attributes | List of all members
NavGraphRosNode Class Reference
Inheritance diagram for NavGraphRosNode:
Inheritance graph
[legend]

Public Member Functions

void cb_fam_timer (const ros::WallTimerEvent &event)
 
void convert_nodes (const std::vector< fawkes::NavGraphNode > &nodes, std::vector< fawkes_msgs::NavGraphNode > &out)
 
virtual void fam_event (const char *filename, unsigned int mask)
 
 NavGraphRosNode (ros::NodeHandle &n)
 
void publish_graph ()
 
bool svs_get_pwcosts_cb (fawkes_msgs::NavGraphGetPairwiseCosts::Request &req, fawkes_msgs::NavGraphGetPairwiseCosts::Response &res)
 
bool svs_search_path_cb (fawkes_msgs::NavGraphSearchPath::Request &req, fawkes_msgs::NavGraphSearchPath::Response &res)
 
virtual ~NavGraphRosNode ()
 

Private Attributes

std::string cfg_base_frame_
 
std::string cfg_global_frame_
 
std::string cfg_navgraph_file_
 
fawkes::FileAlterationMonitor * fam_
 
ros::WallTimer fam_timer_
 
ros::NodeHandle n
 
fawkes::LockPtr< fawkes::NavGraph > navgraph
 
ros::Publisher pub_navgraph_
 
ros::ServiceServer svs_get_pwcosts_
 
ros::ServiceServer svs_search_path_
 
TransformListenerExtendedtf_listener
 

Detailed Description

Definition at line 63 of file fawkes_navgraph_node.cpp.

Constructor & Destructor Documentation

NavGraphRosNode::NavGraphRosNode ( ros::NodeHandle n)
inline

Definition at line 66 of file fawkes_navgraph_node.cpp.

virtual NavGraphRosNode::~NavGraphRosNode ( )
inlinevirtual

Definition at line 109 of file fawkes_navgraph_node.cpp.

Member Function Documentation

void NavGraphRosNode::cb_fam_timer ( const ros::WallTimerEvent event)
inline

Definition at line 153 of file fawkes_navgraph_node.cpp.

void NavGraphRosNode::convert_nodes ( const std::vector< fawkes::NavGraphNode > &  nodes,
std::vector< fawkes_msgs::NavGraphNode > &  out 
)
inline

Definition at line 159 of file fawkes_navgraph_node.cpp.

virtual void NavGraphRosNode::fam_event ( const char *  filename,
unsigned int  mask 
)
inlinevirtual

Definition at line 116 of file fawkes_navgraph_node.cpp.

void NavGraphRosNode::publish_graph ( )
inline

Definition at line 184 of file fawkes_navgraph_node.cpp.

bool NavGraphRosNode::svs_get_pwcosts_cb ( fawkes_msgs::NavGraphGetPairwiseCosts::Request &  req,
fawkes_msgs::NavGraphGetPairwiseCosts::Response &  res 
)
inline

Definition at line 279 of file fawkes_navgraph_node.cpp.

bool NavGraphRosNode::svs_search_path_cb ( fawkes_msgs::NavGraphSearchPath::Request &  req,
fawkes_msgs::NavGraphSearchPath::Response &  res 
)
inline

Definition at line 214 of file fawkes_navgraph_node.cpp.

Member Data Documentation

std::string NavGraphRosNode::cfg_base_frame_
private

Definition at line 344 of file fawkes_navgraph_node.cpp.

std::string NavGraphRosNode::cfg_global_frame_
private

Definition at line 345 of file fawkes_navgraph_node.cpp.

std::string NavGraphRosNode::cfg_navgraph_file_
private

Definition at line 343 of file fawkes_navgraph_node.cpp.

fawkes::FileAlterationMonitor* NavGraphRosNode::fam_
private

Definition at line 348 of file fawkes_navgraph_node.cpp.

ros::WallTimer NavGraphRosNode::fam_timer_
private

Definition at line 353 of file fawkes_navgraph_node.cpp.

ros::NodeHandle NavGraphRosNode::n
private

Definition at line 341 of file fawkes_navgraph_node.cpp.

fawkes::LockPtr<fawkes::NavGraph> NavGraphRosNode::navgraph
private

Definition at line 347 of file fawkes_navgraph_node.cpp.

ros::Publisher NavGraphRosNode::pub_navgraph_
private

Definition at line 350 of file fawkes_navgraph_node.cpp.

ros::ServiceServer NavGraphRosNode::svs_get_pwcosts_
private

Definition at line 352 of file fawkes_navgraph_node.cpp.

ros::ServiceServer NavGraphRosNode::svs_search_path_
private

Definition at line 351 of file fawkes_navgraph_node.cpp.

TransformListenerExtended* NavGraphRosNode::tf_listener
private

Definition at line 355 of file fawkes_navgraph_node.cpp.


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


rcll_fawkes_sim
Author(s): Tim Niemueller
autogenerated on Mon Jun 10 2019 14:31:10