#include <ros/ros.h>
#include <tf/tf.h>
#include <spline_smoother/spline_smoother.h>
#include <spline_smoother/cubic_trajectory.h>
#include <planning_environment/monitors/planning_monitor.h>
#include <motion_planning_msgs/RobotState.h>
#include <motion_planning_msgs/ArmNavigationErrorCodes.h>
#include <motion_planning_msgs/LinkPadding.h>
#include <trajectory_msgs/JointTrajectoryPoint.h>
#include <constraint_aware_spline_smoother/Math.h>
#include <constraint_aware_spline_smoother/DynamicPath.h>
#include "constraint_aware_spline_smoother/ParabolicRamp.h"
Go to the source code of this file.
Classes | |
class | constraint_aware_spline_smoother::FeasibilityChecker |
class | constraint_aware_spline_smoother::ParabolicBlendShortCutter< T > |
Scales the time intervals stretching them if necessary so that the trajectory conforms to velocity limits. More... | |
Namespaces | |
namespace | constraint_aware_spline_smoother |
Variables | |
static const double | constraint_aware_spline_smoother::MIN_DELTA = 0.01 |