Interface for iterating through possible velocities and creating trajectories.
More...
|
virtual dwb_msgs::Trajectory2D | generateTrajectory (const geometry_msgs::Pose2D &start_pose, const nav_2d_msgs::Twist2D &start_vel, const nav_2d_msgs::Twist2D &cmd_vel)=0 |
| Given a cmd_vel in the robot's frame and initial conditions, generate a Trajectory2D. More...
|
|
virtual std::vector< nav_2d_msgs::Twist2D > | getTwists (const nav_2d_msgs::Twist2D ¤t_velocity) |
| Get all the twists for an iteration. More...
|
|
virtual bool | hasMoreTwists ()=0 |
| Test to see whether there are more twists to test. More...
|
|
virtual void | initialize (ros::NodeHandle &nh)=0 |
| Initialize parameters as needed. More...
|
|
virtual nav_2d_msgs::Twist2D | nextTwist ()=0 |
| Return the next twist and advance the iteration. More...
|
|
virtual void | reset () |
| Reset the state (if any) when the planner gets a new goal. More...
|
|
virtual void | startNewIteration (const nav_2d_msgs::Twist2D ¤t_velocity)=0 |
| Start a new iteration based on the current velocity. More...
|
|
virtual | ~TrajectoryGenerator () |
|
Interface for iterating through possible velocities and creating trajectories.
This class defines the plugin interface for two separate but related components.
First, this class provides an iterator interface for exploring all of the velocities to search, given the current velocity.
Second, the class gives an independent interface for creating a trajectory from a twist, i.e. projecting it out in time and space.
Both components rely heavily on the robot's kinematic model, and can share many parameters, which is why they are grouped into a singular class.
Definition at line 61 of file trajectory_generator.h.