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 >
 
using MoveWithToleranceClient = actionlib::SimpleActionClient< planner_cspace_msgs::MoveWithToleranceAction >
 

Protected Member Functions

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

Protected Attributes

std::shared_ptr< MoveBaseClientact_cli_
 
std::shared_ptr< MoveWithToleranceClientact_cli_tolerant_
 
ros::NodeHandle nh_
 
nav_msgs::Path path_
 
ros::NodeHandle pnh_
 
size_t pos_
 
ros::Subscriber sub_path_
 
double tolerance_ang_
 
double tolerance_ang_finish_
 
double tolerance_lin_
 
bool with_tolerance_
 

Detailed Description

Definition at line 41 of file patrol.cpp.

Member Typedef Documentation

◆ MoveBaseClient

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

Definition at line 44 of file patrol.cpp.

◆ MoveWithToleranceClient

using PatrolActionNode::MoveWithToleranceClient = actionlib::SimpleActionClient<planner_cspace_msgs::MoveWithToleranceAction>
protected

Definition at line 45 of file patrol.cpp.

Constructor & Destructor Documentation

◆ PatrolActionNode()

PatrolActionNode::PatrolActionNode ( )
inline

Definition at line 68 of file patrol.cpp.

Member Function Documentation

◆ cbPath()

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

Definition at line 61 of file patrol.cpp.

◆ sendNextGoal()

bool PatrolActionNode::sendNextGoal ( )
inline

Definition at line 93 of file patrol.cpp.

◆ spin()

void PatrolActionNode::spin ( )
inline

Definition at line 130 of file patrol.cpp.

Member Data Documentation

◆ act_cli_

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

Definition at line 51 of file patrol.cpp.

◆ act_cli_tolerant_

std::shared_ptr<MoveWithToleranceClient> PatrolActionNode::act_cli_tolerant_
protected

Definition at line 52 of file patrol.cpp.

◆ nh_

ros::NodeHandle PatrolActionNode::nh_
protected

Definition at line 47 of file patrol.cpp.

◆ path_

nav_msgs::Path PatrolActionNode::path_
protected

Definition at line 54 of file patrol.cpp.

◆ pnh_

ros::NodeHandle PatrolActionNode::pnh_
protected

Definition at line 48 of file patrol.cpp.

◆ pos_

size_t PatrolActionNode::pos_
protected

Definition at line 55 of file patrol.cpp.

◆ sub_path_

ros::Subscriber PatrolActionNode::sub_path_
protected

Definition at line 50 of file patrol.cpp.

◆ tolerance_ang_

double PatrolActionNode::tolerance_ang_
protected

Definition at line 58 of file patrol.cpp.

◆ tolerance_ang_finish_

double PatrolActionNode::tolerance_ang_finish_
protected

Definition at line 59 of file patrol.cpp.

◆ tolerance_lin_

double PatrolActionNode::tolerance_lin_
protected

Definition at line 57 of file patrol.cpp.

◆ with_tolerance_

bool PatrolActionNode::with_tolerance_
protected

Definition at line 56 of file patrol.cpp.


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


planner_cspace
Author(s): Atsushi Watanabe
autogenerated on Fri May 16 2025 02:15:23