Protected Types | Protected Member Functions | Protected Attributes | List of all members
NavigateBoundary Class Reference
Inheritance diagram for NavigateBoundary:
Inheritance graph
[legend]

Protected Types

using ActionClient = actionlib::SimpleActionClient< move_base_msgs::MoveBaseAction >
 
using ActionClientPtr = std::shared_ptr< ActionClient >
 

Protected Member Functions

void cbPath (const nav_msgs::Path::ConstPtr &msg)
 
void cbStatus (const planner_cspace_msgs::PlannerStatus::ConstPtr &msg)
 
 NavigateBoundary ()
 
void publishTransform (const double x, const double y)
 
virtual void SetUp ()
 

Protected Attributes

ActionClientPtr move_base_
 
ros::NodeHandle nh_
 
nav_msgs::Path::ConstPtr path_
 
planner_cspace_msgs::PlannerStatus::ConstPtr status_
 
ros::Subscriber sub_path_
 
ros::Subscriber sub_status_
 
tf2_ros::TransformBroadcaster tfb_
 

Detailed Description

Definition at line 45 of file test_navigate_boundary.cpp.

Member Typedef Documentation

◆ ActionClient

using NavigateBoundary::ActionClient = actionlib::SimpleActionClient<move_base_msgs::MoveBaseAction>
protected

Definition at line 48 of file test_navigate_boundary.cpp.

◆ ActionClientPtr

using NavigateBoundary::ActionClientPtr = std::shared_ptr<ActionClient>
protected

Definition at line 49 of file test_navigate_boundary.cpp.

Constructor & Destructor Documentation

◆ NavigateBoundary()

NavigateBoundary::NavigateBoundary ( )
inlineprotected

Definition at line 59 of file test_navigate_boundary.cpp.

Member Function Documentation

◆ cbPath()

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

Definition at line 97 of file test_navigate_boundary.cpp.

◆ cbStatus()

void NavigateBoundary::cbStatus ( const planner_cspace_msgs::PlannerStatus::ConstPtr &  msg)
inlineprotected

Definition at line 101 of file test_navigate_boundary.cpp.

◆ publishTransform()

void NavigateBoundary::publishTransform ( const double  x,
const double  y 
)
inlineprotected

Definition at line 69 of file test_navigate_boundary.cpp.

◆ SetUp()

virtual void NavigateBoundary::SetUp ( )
inlineprotectedvirtual

Definition at line 80 of file test_navigate_boundary.cpp.

Member Data Documentation

◆ move_base_

ActionClientPtr NavigateBoundary::move_base_
protected

Definition at line 57 of file test_navigate_boundary.cpp.

◆ nh_

ros::NodeHandle NavigateBoundary::nh_
protected

Definition at line 51 of file test_navigate_boundary.cpp.

◆ path_

nav_msgs::Path::ConstPtr NavigateBoundary::path_
protected

Definition at line 56 of file test_navigate_boundary.cpp.

◆ status_

planner_cspace_msgs::PlannerStatus::ConstPtr NavigateBoundary::status_
protected

Definition at line 55 of file test_navigate_boundary.cpp.

◆ sub_path_

ros::Subscriber NavigateBoundary::sub_path_
protected

Definition at line 54 of file test_navigate_boundary.cpp.

◆ sub_status_

ros::Subscriber NavigateBoundary::sub_status_
protected

Definition at line 53 of file test_navigate_boundary.cpp.

◆ tfb_

tf2_ros::TransformBroadcaster NavigateBoundary::tfb_
protected

Definition at line 52 of file test_navigate_boundary.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