Public Member Functions | |
void | SetUp () final |
void | TearDown () final |
![]() | |
ActionTestBase () | |
void | SetUp () |
~ActionTestBase () | |
Protected Member Functions | |
void | cbPath (const nav_msgs::Path::ConstPtr &msg) |
::testing::AssertionResult | comparePath (const nav_msgs::Path &path1, const nav_msgs::Path &path2) |
move_base_msgs::MoveBaseGoal | CreateGoalInFree () |
double | getAveragePathInterval (const ros::Duration &costmap_publishing_interval) |
bool | isPathIncludingCurves () const |
void | publishMapAndRobot (const double x, const double y, const double yaw) |
void | sendGoalAndWaitForPath () |
![]() | |
void | cbStatus (const planner_cspace_msgs::PlannerStatus::ConstPtr &msg) |
std::string | statusString () const |
Protected Attributes | |
planner_cspace::Planner3DConfig | default_config_ |
ros::Time | last_path_received_time_ |
nav_msgs::OccupancyGrid | map_overlay_ |
nav_msgs::Path::ConstPtr | path_ |
int | path_received_count_ |
std::unique_ptr< dynamic_reconfigure::Client< planner_cspace::Planner3DConfig > > | planner_3d_client_ |
ros::Publisher | pub_map_overlay_ |
ros::Publisher | pub_odom_ |
ros::Subscriber | sub_path_ |
tf2_ros::TransformBroadcaster | tfb_ |
![]() | |
bool | map_ready_ |
ActionClientPtr | move_base_ |
ros::NodeHandle | node_ |
planner_cspace_msgs::PlannerStatus::ConstPtr | planner_status_ |
ros::Subscriber | sub_status_ |
tf2_ros::Buffer | tfbuf_ |
tf2_ros::TransformListener | tfl_ |
Additional Inherited Members | |
![]() | |
using | ActionClient = actionlib::SimpleActionClient< move_base_msgs::MoveBaseAction > |
using | ActionClientPtr = std::shared_ptr< ActionClient > |
Definition at line 46 of file test_dynamic_parameter_change.cpp.
|
inlineprotected |
Definition at line 100 of file test_dynamic_parameter_change.cpp.
|
inlineprotected |
Definition at line 139 of file test_dynamic_parameter_change.cpp.
|
inlineprotected |
Definition at line 107 of file test_dynamic_parameter_change.cpp.
|
inlineprotected |
Definition at line 213 of file test_dynamic_parameter_change.cpp.
|
inlineprotected |
Definition at line 122 of file test_dynamic_parameter_change.cpp.
|
inlineprotected |
Definition at line 190 of file test_dynamic_parameter_change.cpp.
|
inlineprotected |
Definition at line 168 of file test_dynamic_parameter_change.cpp.
|
inlinefinal |
Definition at line 50 of file test_dynamic_parameter_change.cpp.
|
inlinefinal |
Definition at line 94 of file test_dynamic_parameter_change.cpp.
|
protected |
Definition at line 260 of file test_dynamic_parameter_change.cpp.
|
protected |
Definition at line 262 of file test_dynamic_parameter_change.cpp.
|
protected |
Definition at line 259 of file test_dynamic_parameter_change.cpp.
|
protected |
Definition at line 255 of file test_dynamic_parameter_change.cpp.
|
protected |
Definition at line 261 of file test_dynamic_parameter_change.cpp.
|
protected |
Definition at line 256 of file test_dynamic_parameter_change.cpp.
|
protected |
Definition at line 257 of file test_dynamic_parameter_change.cpp.
|
protected |
Definition at line 258 of file test_dynamic_parameter_change.cpp.
|
protected |
Definition at line 254 of file test_dynamic_parameter_change.cpp.
|
protected |
Definition at line 253 of file test_dynamic_parameter_change.cpp.