Public Member Functions | Protected Types | Protected Member Functions | Protected Attributes | List of all members
PatrolActionNode Class Reference

Public Member Functions

 PatrolActionNode ()
 
bool sendNextGoal ()
 
void spin ()
 

Protected Types

using MoveBaseClient = actionlib::SimpleActionClient< move_base_msgs::MoveBaseAction >
 

Protected Member Functions

void cbPath (const nav_msgs::Path::ConstPtr &msg)
 

Protected Attributes

std::shared_ptr< MoveBaseClientact_cli_
 
ros::NodeHandle nh_
 
nav_msgs::Path path_
 
ros::NodeHandle pnh_
 
size_t pos_
 
ros::Subscriber sub_path_
 

Detailed Description

Definition at line 38 of file patrol.cpp.

Member Typedef Documentation

using PatrolActionNode::MoveBaseClient = actionlib::SimpleActionClient<move_base_msgs::MoveBaseAction>
protected

Definition at line 41 of file patrol.cpp.

Constructor & Destructor Documentation

PatrolActionNode::PatrolActionNode ( )
inline

Definition at line 59 of file patrol.cpp.

Member Function Documentation

void PatrolActionNode::cbPath ( const nav_msgs::Path::ConstPtr &  msg)
inlineprotected

Definition at line 52 of file patrol.cpp.

bool PatrolActionNode::sendNextGoal ( )
inline

Definition at line 71 of file patrol.cpp.

void PatrolActionNode::spin ( )
inline

Definition at line 92 of file patrol.cpp.

Member Data Documentation

std::shared_ptr<MoveBaseClient> PatrolActionNode::act_cli_
protected

Definition at line 47 of file patrol.cpp.

ros::NodeHandle PatrolActionNode::nh_
protected

Definition at line 43 of file patrol.cpp.

nav_msgs::Path PatrolActionNode::path_
protected

Definition at line 49 of file patrol.cpp.

ros::NodeHandle PatrolActionNode::pnh_
protected

Definition at line 44 of file patrol.cpp.

size_t PatrolActionNode::pos_
protected

Definition at line 50 of file patrol.cpp.

ros::Subscriber PatrolActionNode::sub_path_
protected

Definition at line 46 of file patrol.cpp.


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


planner_cspace
Author(s): Atsushi Watanabe
autogenerated on Tue Jul 9 2019 05:00:13