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_ |
Definition at line 42 of file test_navigate_boundary.cpp.
|
protected |
Definition at line 45 of file test_navigate_boundary.cpp.
|
protected |
Definition at line 46 of file test_navigate_boundary.cpp.
|
inlineprotected |
Definition at line 54 of file test_navigate_boundary.cpp.
|
inlineprotected |
Definition at line 91 of file test_navigate_boundary.cpp.
|
inlineprotected |
Definition at line 64 of file test_navigate_boundary.cpp.
|
inlineprotectedvirtual |
Definition at line 75 of file test_navigate_boundary.cpp.
|
protected |
Definition at line 52 of file test_navigate_boundary.cpp.
|
protected |
Definition at line 48 of file test_navigate_boundary.cpp.
|
protected |
Definition at line 51 of file test_navigate_boundary.cpp.
|
protected |
Definition at line 50 of file test_navigate_boundary.cpp.
|
protected |
Definition at line 49 of file test_navigate_boundary.cpp.