#include <trajectory_tracker_test.h>
|
| using | ParamType = trajectory_tracker::TrajectoryTrackerConfig |
| |
|
| void | cbCmdVel (const geometry_msgs::Twist::ConstPtr &msg) |
| |
| void | cbStatus (const trajectory_tracker_msgs::TrajectoryTrackerStatus::ConstPtr &msg) |
| |
Definition at line 62 of file trajectory_tracker_test.h.
◆ ParamType
◆ TrajectoryTrackerTest()
| TrajectoryTrackerTest::TrajectoryTrackerTest |
( |
| ) |
|
|
inline |
◆ cbCmdVel()
| void TrajectoryTrackerTest::cbCmdVel |
( |
const geometry_msgs::Twist::ConstPtr & |
msg | ) |
|
|
inlineprivate |
◆ cbStatus()
| void TrajectoryTrackerTest::cbStatus |
( |
const trajectory_tracker_msgs::TrajectoryTrackerStatus::ConstPtr & |
msg | ) |
|
|
inlineprivate |
◆ getCmdVelFrameRate()
| double TrajectoryTrackerTest::getCmdVelFrameRate |
( |
| ) |
const |
|
inline |
◆ getConfig()
| bool TrajectoryTrackerTest::getConfig |
( |
ParamType & |
config | ) |
const |
|
inline |
◆ getPos()
| Eigen::Vector2d TrajectoryTrackerTest::getPos |
( |
| ) |
const |
|
inlineprotected |
◆ getYaw()
| double TrajectoryTrackerTest::getYaw |
( |
| ) |
const |
|
inlineprotected |
◆ initState() [1/2]
| void TrajectoryTrackerTest::initState |
( |
const Eigen::Vector2d & |
pos, |
|
|
const float |
yaw |
|
) |
| |
|
inline |
◆ initState() [2/2]
◆ publishPath()
| void TrajectoryTrackerTest::publishPath |
( |
const std::vector< Eigen::Vector3d > & |
poses | ) |
|
|
inline |
◆ publishPathVelocity()
| void TrajectoryTrackerTest::publishPathVelocity |
( |
const std::vector< Eigen::Vector4d > & |
poses | ) |
|
|
inline |
◆ publishTransform() [1/2]
| void TrajectoryTrackerTest::publishTransform |
( |
| ) |
|
|
inline |
◆ publishTransform() [2/2]
| void TrajectoryTrackerTest::publishTransform |
( |
const nav_msgs::Odometry & |
odom | ) |
|
|
inline |
◆ setConfig()
| bool TrajectoryTrackerTest::setConfig |
( |
const ParamType & |
config | ) |
|
|
inline |
◆ waitUntilStart()
| void TrajectoryTrackerTest::waitUntilStart |
( |
const std::function< void()> |
func = nullptr | ) |
|
|
inline |
◆ cmd_vel_
| geometry_msgs::Twist::ConstPtr TrajectoryTrackerTest::cmd_vel_ |
◆ cmd_vel_count_
| int TrajectoryTrackerTest::cmd_vel_count_ |
|
private |
◆ cmd_vel_time_
| ros::Time TrajectoryTrackerTest::cmd_vel_time_ |
|
private |
◆ delay_
◆ dynamic_reconfigure_client_
◆ error_ang_
| double TrajectoryTrackerTest::error_ang_ |
|
protected |
◆ error_large_lin_
| double TrajectoryTrackerTest::error_large_lin_ |
|
protected |
◆ error_lin_
| double TrajectoryTrackerTest::error_lin_ |
|
protected |
◆ initial_cmd_vel_time_
| ros::Time TrajectoryTrackerTest::initial_cmd_vel_time_ |
|
private |
◆ last_path_header_
◆ nh_
◆ odom_buffer_
| std::list<nav_msgs::Odometry> TrajectoryTrackerTest::odom_buffer_ |
|
private |
◆ pnh_
◆ pose_
◆ pub_odom_
◆ pub_path_
◆ pub_path_vel_
◆ status_
| trajectory_tracker_msgs::TrajectoryTrackerStatus::ConstPtr TrajectoryTrackerTest::status_ |
◆ sub_cmd_vel_
◆ sub_status_
◆ tfb_
◆ trans_stamp_last_
| ros::Time TrajectoryTrackerTest::trans_stamp_last_ |
|
private |
The documentation for this class was generated from the following file: