stomp_moveit::cost_functions::CollisionCheck | Assigns a cost value to each robot state by evaluating if the robot is in collision |
stomp_moveit::update_filters::ControlCostProjection | |
stomp_moveit::noisy_filters::JointLimits | Checks that the joint values are within the limits as defined in the urdf file. It modifies the values of those joints that exceed the limits |
stomp_moveit::utils::kinematics::KinematicConfig | |
stomp_moveit::utils::KinematicConfig | Convenience structure that contains the variables used in solving for an ik solution |
stomp_moveit::noisy_filters::MultiTrajectoryVisualization | Publishes rviz markers to visualize the noisy trajectories |
stomp_moveit::utils::MultivariateGaussian | Generates samples from a multivariate gaussian distribution |
stomp_moveit::noise_generators::NormalDistributionSampling | Uses a normal distribution to apply noise onto the trajectory |
stomp_moveit::cost_functions::ObstacleDistanceGradient | |
PluginData | Packs plugin information into a single struct |
stomp_moveit::utils::polynomial::PolyFitRequest | The Polynomial Fit request data |
stomp_moveit::utils::polynomial::PolyFitResults | The Polynomial Fit results data |
stomp_moveit::update_filters::PolynomialSmoother | This is a constrained polynomial trajectory smoother |
stomp_moveit::cost_functions::StompCostFunction | Assigns a cost value to each robot state by evaluating the minimum distance between the robot and the nearest obstacle |
stomp_moveit::noise_generators::StompNoiseGenerator | |
stomp_moveit::StompNoiseGenerator | Interface class for plugins that apply random noise to the trajectory in order to explore the workspace |
stomp_moveit::noisy_filters::StompNoisyFilter | Interface class for filtering noisy trajectories |
stomp_moveit::StompOptimizationTask | Loads and manages the STOMP plugins during the planning process |
stomp_moveit::StompPlanner | The PlanningContext specialization that wraps the STOMP algorithm |
stomp_moveit::StompPlannerManager | The PlannerManager implementation that loads STOMP into moveit |
stomp_moveit::update_filters::StompUpdateFilter | Interface class which applies filtering methods to the update parameters before it is added onto the optimized trajectory |
stomp_moveit::update_filters::TrajectoryVisualization | Publishes rviz markers to visualize the optimized trajectory |
stomp_moveit::update_filters | Uses a Control Cost Matrix projection in order to smooth out the trajectory. The matrix is built using a numerical derivative method |
stomp_moveit::update_filters::UpdateLogger | Saves the update values into a file for post analysis. The file is compatible with the python numpy library and can be loaded into a numpy array by running. 'numpy.loadtxt(file_name)' |