Classes |
class | KinematicParameters |
| A dynamically reconfigurable class containing one representation of the robot's kinematics. More...
|
class | LimitedAccelGenerator |
| Limits the acceleration in the generated trajectories to a fraction of the simulated time. More...
|
class | OneDVelocityIterator |
| An iterator for generating a number of samples in a range. More...
|
class | SimpleGoalChecker |
| Goal Checker plugin that only checks the position difference. More...
|
class | StandardTrajectoryGenerator |
| Standard DWA-like trajectory generator. More...
|
class | StoppedGoalChecker |
| Goal Checker plugin that checks the position difference and velocity. More...
|
class | VelocityIterator |
class | XYThetaIterator |
Functions |
double | projectVelocity (double v0, double accel, double decel, double dt, double target) |
| Given initial conditions and a time, figure out the end velocity.
|
void | setDecelerationAsNeeded (const ros::NodeHandle &nh, const std::string dimension) |
| Helper function to set the deceleration to the negative acceleration if it was not already set.
|
Variables |
const double | EPSILON = 1E-5 |