Here are the classes, structs, unions and interfaces with brief descriptions:
[detail level 1234]
▼Nstomp_moveit | |
▼Ncost_functions | |
CCollisionCheck | Assigns a cost value to each robot state by evaluating if the robot is in collision |
CObstacleDistanceGradient | |
CStompCostFunction | Assigns a cost value to each robot state by evaluating the minimum distance between the robot and the nearest obstacle |
▼Nnoise_generators | |
CNormalDistributionSampling | Uses a normal distribution to apply noise onto the trajectory |
CStompNoiseGenerator | |
▼Nnoisy_filters | |
CJointLimits | 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 |
CMultiTrajectoryVisualization | Publishes rviz markers to visualize the noisy trajectories |
CStompNoisyFilter | Interface class for filtering noisy trajectories |
▼Nupdate_filters | |
CControlCostProjection | |
CPolynomialSmoother | This is a constrained polynomial trajectory smoother |
CStompUpdateFilter | Interface class which applies filtering methods to the update parameters before it is added onto the optimized trajectory |
CTrajectoryVisualization | Publishes rviz markers to visualize the optimized trajectory |
CUpdateLogger | 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)' |
▼Nutils | |
▼Nkinematics | Utility functions related to finding Inverse Kinematics solutions |
CIKSolver | Wrapper around an IK solver implementation |
▼Npolynomial | |
CPolyFitRequest | The Polynomial Fit request data |
CPolyFitResults | The Polynomial Fit results data |
CMultivariateGaussian | Generates samples from a multivariate gaussian distribution |
CStompNoiseGenerator | Interface class for plugins that apply random noise to the trajectory in order to explore the workspace |
CStompOptimizationTask | Loads and manages the STOMP plugins during the planning process |
CStompPlanner | The PlanningContext specialization that wraps the STOMP algorithm |
CStompPlannerManager | The PlannerManager implementation that loads STOMP into moveit |
CStompSmoothingAdapter | |
Cupdate_filters | Uses a Control Cost Matrix projection in order to smooth out the trajectory. The matrix is built using a numerical derivative method |
CPluginData | Packs plugin information into a single struct |