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)
 
 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_
 
ros::Subscriber sub_path_
 
tf2_ros::TransformBroadcaster tfb_
 

Detailed Description

Definition at line 42 of file test_navigate_boundary.cpp.

Member Typedef Documentation

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

Definition at line 45 of file test_navigate_boundary.cpp.

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

Definition at line 46 of file test_navigate_boundary.cpp.

Constructor & Destructor Documentation

NavigateBoundary::NavigateBoundary ( )
inlineprotected

Definition at line 54 of file test_navigate_boundary.cpp.

Member Function Documentation

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

Definition at line 91 of file test_navigate_boundary.cpp.

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

Definition at line 64 of file test_navigate_boundary.cpp.

virtual void NavigateBoundary::SetUp ( )
inlineprotectedvirtual

Definition at line 75 of file test_navigate_boundary.cpp.

Member Data Documentation

ActionClientPtr NavigateBoundary::move_base_
protected

Definition at line 52 of file test_navigate_boundary.cpp.

ros::NodeHandle NavigateBoundary::nh_
protected

Definition at line 48 of file test_navigate_boundary.cpp.

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

Definition at line 51 of file test_navigate_boundary.cpp.

ros::Subscriber NavigateBoundary::sub_path_
protected

Definition at line 50 of file test_navigate_boundary.cpp.

tf2_ros::TransformBroadcaster NavigateBoundary::tfb_
protected

Definition at line 49 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 Wed May 12 2021 02:20:43