Protected Member Functions | |
| void | runTest (const double goal_tolerance_lin_vel, const double goal_tolerance_ang_vel, const double linear_vel, const double rotation_vel, const int32_t expected_status) |
Protected Member Functions inherited from TrajectoryTrackerTest | |
| Eigen::Vector2d | getPos () const |
| double | getYaw () const |
Additional Inherited Members | |
Public Member Functions inherited from TrajectoryTrackerTest | |
| double | getCmdVelFrameRate () const |
| bool | getConfig (ParamType &config) const |
| void | initState (const Eigen::Vector2d &pos, const float yaw) |
| void | initState (const tf2::Transform &pose) |
| void | publishPath (const std::vector< Eigen::Vector3d > &poses) |
| void | publishPathVelocity (const std::vector< Eigen::Vector4d > &poses) |
| void | publishTransform () |
| void | publishTransform (const nav_msgs::Odometry &odom) |
| bool | setConfig (const ParamType &config) |
| TrajectoryTrackerTest () | |
| void | waitUntilStart (const std::function< void()> func=nullptr) |
Public Attributes inherited from TrajectoryTrackerTest | |
| geometry_msgs::Twist::ConstPtr | cmd_vel_ |
| ros::Duration | delay_ |
| tf2::Transform | pose_ |
| trajectory_tracker_msgs::TrajectoryTrackerStatus::ConstPtr | status_ |
Protected Types inherited from TrajectoryTrackerTest | |
| using | ParamType = trajectory_tracker::TrajectoryTrackerConfig |
Protected Attributes inherited from TrajectoryTrackerTest | |
| std::unique_ptr< dynamic_reconfigure::Client< ParamType > > | dynamic_reconfigure_client_ |
| double | error_ang_ |
| double | error_large_lin_ |
| double | error_lin_ |
| std_msgs::Header | last_path_header_ |
Definition at line 37 of file test_trajectory_tracker_overshoot.cpp.
|
inlineprotected |
Definition at line 40 of file test_trajectory_tracker_overshoot.cpp.