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

Public Member Functions

void SetUp () final
 
void TearDown () final
 
- Public Member Functions inherited from ActionTestBase< move_base_msgs::MoveBaseAction, ACTION_TOPIC_MOVE_BASE >
 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 ()
 
- Protected Member Functions inherited from ActionTestBase< move_base_msgs::MoveBaseAction, ACTION_TOPIC_MOVE_BASE >
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_
 
- Protected Attributes inherited from ActionTestBase< move_base_msgs::MoveBaseAction, ACTION_TOPIC_MOVE_BASE >
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

- Protected Types inherited from ActionTestBase< move_base_msgs::MoveBaseAction, ACTION_TOPIC_MOVE_BASE >
using ActionClient = actionlib::SimpleActionClient< move_base_msgs::MoveBaseAction >
 
using ActionClientPtr = std::shared_ptr< ActionClient >
 

Detailed Description

Definition at line 46 of file test_dynamic_parameter_change.cpp.

Member Function Documentation

◆ cbPath()

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

Definition at line 100 of file test_dynamic_parameter_change.cpp.

◆ comparePath()

::testing::AssertionResult DynamicParameterChangeTest::comparePath ( const nav_msgs::Path &  path1,
const nav_msgs::Path &  path2 
)
inlineprotected

Definition at line 139 of file test_dynamic_parameter_change.cpp.

◆ CreateGoalInFree()

move_base_msgs::MoveBaseGoal DynamicParameterChangeTest::CreateGoalInFree ( )
inlineprotected

Definition at line 107 of file test_dynamic_parameter_change.cpp.

◆ getAveragePathInterval()

double DynamicParameterChangeTest::getAveragePathInterval ( const ros::Duration costmap_publishing_interval)
inlineprotected

Definition at line 213 of file test_dynamic_parameter_change.cpp.

◆ isPathIncludingCurves()

bool DynamicParameterChangeTest::isPathIncludingCurves ( ) const
inlineprotected

Definition at line 122 of file test_dynamic_parameter_change.cpp.

◆ publishMapAndRobot()

void DynamicParameterChangeTest::publishMapAndRobot ( const double  x,
const double  y,
const double  yaw 
)
inlineprotected

Definition at line 190 of file test_dynamic_parameter_change.cpp.

◆ sendGoalAndWaitForPath()

void DynamicParameterChangeTest::sendGoalAndWaitForPath ( )
inlineprotected

Definition at line 168 of file test_dynamic_parameter_change.cpp.

◆ SetUp()

void DynamicParameterChangeTest::SetUp ( )
inlinefinal

Definition at line 50 of file test_dynamic_parameter_change.cpp.

◆ TearDown()

void DynamicParameterChangeTest::TearDown ( )
inlinefinal

Definition at line 94 of file test_dynamic_parameter_change.cpp.

Member Data Documentation

◆ default_config_

planner_cspace::Planner3DConfig DynamicParameterChangeTest::default_config_
protected

Definition at line 260 of file test_dynamic_parameter_change.cpp.

◆ last_path_received_time_

ros::Time DynamicParameterChangeTest::last_path_received_time_
protected

Definition at line 262 of file test_dynamic_parameter_change.cpp.

◆ map_overlay_

nav_msgs::OccupancyGrid DynamicParameterChangeTest::map_overlay_
protected

Definition at line 259 of file test_dynamic_parameter_change.cpp.

◆ path_

nav_msgs::Path::ConstPtr DynamicParameterChangeTest::path_
protected

Definition at line 255 of file test_dynamic_parameter_change.cpp.

◆ path_received_count_

int DynamicParameterChangeTest::path_received_count_
protected

Definition at line 261 of file test_dynamic_parameter_change.cpp.

◆ planner_3d_client_

std::unique_ptr<dynamic_reconfigure::Client<planner_cspace::Planner3DConfig> > DynamicParameterChangeTest::planner_3d_client_
protected

Definition at line 256 of file test_dynamic_parameter_change.cpp.

◆ pub_map_overlay_

ros::Publisher DynamicParameterChangeTest::pub_map_overlay_
protected

Definition at line 257 of file test_dynamic_parameter_change.cpp.

◆ pub_odom_

ros::Publisher DynamicParameterChangeTest::pub_odom_
protected

Definition at line 258 of file test_dynamic_parameter_change.cpp.

◆ sub_path_

ros::Subscriber DynamicParameterChangeTest::sub_path_
protected

Definition at line 254 of file test_dynamic_parameter_change.cpp.

◆ tfb_

tf2_ros::TransformBroadcaster DynamicParameterChangeTest::tfb_
protected

Definition at line 253 of file test_dynamic_parameter_change.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