35 #ifndef DWB_PLUGINS_LIMITED_ACCEL_GENERATOR_H 36 #define DWB_PLUGINS_LIMITED_ACCEL_GENERATOR_H 63 nav_2d_msgs::Twist2D
computeNewVelocity(
const nav_2d_msgs::Twist2D& cmd_vel,
const nav_2d_msgs::Twist2D& start_vel,
64 const double dt)
override;
69 #endif // DWB_PLUGINS_LIMITED_ACCEL_GENERATOR_H
void startNewIteration(const nav_2d_msgs::Twist2D ¤t_velocity) override
Limits the acceleration in the generated trajectories to a fraction of the simulated time...
Standard DWA-like trajectory generator.
void initialize(ros::NodeHandle &nh) override
double acceleration_time_
void checkUseDwaParam(const ros::NodeHandle &nh) override
Check if the deprecated use_dwa parameter is set to the functionality that matches this class...
nav_2d_msgs::Twist2D computeNewVelocity(const nav_2d_msgs::Twist2D &cmd_vel, const nav_2d_msgs::Twist2D &start_vel, const double dt) override
Calculate the velocity after a set period of time, given the desired velocity and acceleration limits...