Class Hierarchy

Go to the graphical class hierarchy

This inheritance list is sorted roughly, but not completely, alphabetically:
[detail level 1234]
 Ccollision_detection::World::ActionRepresents an action that occurred on an object in the world. Several bits may be set indicating several things happened to the object. If the DESTROY bit is set, other bits will not be set
 CAlignedBox3d
 Ccollision_detection::AllowedCollisionMatrixDefinition of a structure for the allowed collision matrix. All elements in the collision world are referred to by their names. This class represents which collisions are allowed to happen and which are not
 Cmoveit::core::AttachedBodyObject defining bodies that can be attached to robot links. This is useful when handling objects picked up by the robot
 Cmoveit::tools::Profiler::AvgInfoInformation maintained about averaged values
 Ccollision_detection::BodyDecomposition
 Ccollision_detection::BodyDecompositionCache
 Ccollision_detection::CollisionData
 Cplanning_scene::PlanningScene::CollisionDetector
 Ccollision_detection::CollisionDetectorAllocatorAn allocator for a compatible CollisionWorld/CollisionRobot pair
 Ccollision_detection::CollisionGeometryData
 Ccollision_detection::CollisionPluginPlugin API for loading a custom collision detection robot/world
 Ccollision_detection::CollisionRequestRepresentation of a collision checking request
 Ccollision_detection::CollisionResultRepresentation of a collision checking result
 Ccollision_detection::CollisionRobotThis class represents a collision model of the robot and can be used for self collision checks (to check if the robot is in collision with itself) or in collision checks with a different robot. Collision checks with the environment are performed using the CollisionWorld class
 Ccollision_detection::CollisionSphere
 Cdistance_field::compareEigen_Vector3iStruct for sorting type Eigen::Vector3i for use in sorted std containers. Sorts in z order, then y order, then x order
 Ckinematic_constraints::ConstraintEvaluationResultStruct for containing the results of constraint evaluation
 Cconstraint_samplers::ConstraintSamplerConstraintSampler is an abstract base class that allows the sampling of a kinematic state for a particular group of a robot
 Cconstraint_samplers::ConstraintSamplerAllocator
 Cconstraint_samplers::ConstraintSamplerManagerThis class assists in the generation of a ConstraintSampler for a particular group from a moveit_msgs::Constraints
 Ccollision_detection::ContactDefinition of a contact point
 Cmoveit_controller_manager::MoveItControllerManager::ControllerStateEach controller known to MoveIt! has a state. This structure describes that controller's state
 Ccollision_detection::CostSourceWhen collision costs are computed, this structure contains information about the partial cost incurred in a particular volume
 Ccollision_detection::DistanceData
 Cdistance_field::DistanceFieldDistanceField is an abstract base class for computing distances from sets of 3D obstacle points. The distance assigned to a freespace cell should be the distance to the closest obstacle cell. Cells that are obstacle cells should either be marked as zero distance, or may have a negative distance if a signed version of the distance field is being used and an obstacle point is internal to an obstacle volume
 Ccollision_detection::DistanceFieldCacheEntry
 Ccollision_detection::CollisionWorldDistanceField::DistanceFieldCacheEntry
 Ccollision_detection::DistanceRequest
 Ccollision_detection::DistanceResult
 Ccollision_detection::DistanceResultsData
 Cdynamics_solver::DynamicsSolver
 CEIGEN_MAKE_ALIGNED_OPERATOR_NEWROS/KDL based interface for the inverse kinematics of the PR2 arm
 Cenable_shared_from_this
 Cmoveit_controller_manager::ExecutionStatusThe reported execution status
 Ccollision_detection::FCLGeometry
 Ccollision_detection::FCLManager
 Ccollision_detection::FCLObject
 Ccollision_detection::FCLShapeCache
 Ccollision_detection::GradientInfo
 Cmoveit::core::JointModelGroup::GroupMimicUpdate
 Ccollision_detection::GroupStateRepresentation
 Ccollision_detection::IfSameType< T1, T2 >
 Ccollision_detection::IfSameType< T, T >
 Cconstraint_samplers::IKSamplingPoseA structure for potentially holding a position constraint and an orientation constraint for use during Ik Sampling
 Ctrajectory_processing::IterativeParabolicTimeParameterizationThis class modifies the timestamps of a trajectory to respect velocity and acceleration constraints
 Ctrajectory_processing::IterativeSplineParameterizationThis class sets the timestamps of a trajectory to enforce velocity, acceleration constraints. Initial/final velocities and accelerations may be specified in the trajectory. Velocity and acceleration limits are specified in the model
 Cconstraint_samplers::JointConstraintSampler::JointInfoAn internal structure used for maintaining constraints on a particular joint
 Cmoveit::core::JointModelA joint from the robot. Models the transform that this joint applies in the kinematic chain. A joint consists of multiple variables. In the simplest case, when the joint is a single DOF, there is only one variable and its name is the same as the joint's name. For multi-DOF joints, each variable has a local name (e.g., x, y) but the full variable name as seen from the outside of this class is a concatenation of the "joint name"/"local name" (e.g., a joint named 'base' with local variables 'x' and 'y' will store its full variable names as 'base/x' and 'base/y'). Local names are never used to reference variables directly
 Cmoveit::core::JointModelGroup
 Cmoveit::core::JumpThresholdStruct for containing jump_threshold
 Ckinematic_constraints::KinematicConstraintBase class for representing a kinematic constraint
 Ckinematic_constraints::KinematicConstraintSetA class that contains many different constraints, and can check RobotState *versus the full set. A set is satisfied if and only if all constraints are satisfied
 Ckinematics::KinematicsBaseProvides an interface for kinematics solvers
 Ckinematics_metrics::KinematicsMetricsCompute different kinds of metrics for kinematics evaluation. Currently includes manipulability
 Ckinematics::KinematicsQueryOptionsA set of options for the kinematics solver
 Ckinematics::KinematicsResult
 Cmoveit::core::JointModelGroup::KinematicsSolver
 Cmoveit::core::LinkModelA link from the robot. Contains the constant transform applied to the link and its geometry
 Cmoveit::core::MaxEEFStepStruct for containing max_step for computeCartesianPath
 Cplanning_interface::MotionPlanDetailedResponse
 Cplanning_interface::MotionPlanResponse
 Cmoveit_controller_manager::MoveItControllerHandleMoveIt! sends commands to a controller via a handle that satisfies this interface
 Cmoveit_controller_manager::MoveItControllerManagerMoveIt! does not enforce how controllers are implemented. To make your controllers usable by MoveIt, this interface needs to be implemented. The main purpose of this interface is to expose the set of known controllers and potentially to allow activating and deactivating them, if multiple controllers are available
 Cmoveit_sensor_manager::MoveItSensorManager
 Cnoncopyable
 Ccollision_detection::World::ObjectA representation of an object
 Ccollision_detection::World::Observer
 Ccollision_detection::World::ObserverHandle
 Cconstraint_samplers::OrderSamplers
 Cmoveit::tools::Profiler::PerThreadInformation to be maintained for each thread
 Cplanning_interface::PlannerConfigurationSettingsSpecify the settings for a particular planning algorithm, for a particular group. The Planner plugin uses these settings to configure the algorithm
 Cplanning_interface::PlannerManagerBase class for a MoveIt! planner
 Cplanning_interface::PlanningContextRepresentation of a particular planning context – the planning scene and the request are known, solution is not yet computed
 Cplanning_request_adapter::PlanningRequestAdapter
 Cplanning_request_adapter::PlanningRequestAdapterChainApply a sequence of adapters to a motion plan
 Ccollision_detection::PosedBodyPointDecomposition
 Ccollision_detection::PosedBodyPointDecompositionVector
 Ccollision_detection::PosedBodySphereDecomposition
 Ccollision_detection::PosedBodySphereDecompositionVector
 Cpr2_arm_kinematics::PR2ArmIK
 Cdistance_field::PropDistanceFieldVoxelStructure that holds voxel information for the DistanceField. Will be used in VoxelGrid
 Ccollision_detection::ProximityInfo
 Cmoveit::core::RobotModelDefinition of a kinematic model. This class is not thread safe, however multiple instances can be created
 Cmoveit::core::RobotStateRepresentation of a robot's state. This includes position, velocity, acceleration and effort
 Crobot_trajectory::RobotTrajectoryMaintain a sequence of waypoints and the time durations between these waypoints
 Cruntime_error
 Cmoveit::tools::Profiler::ScopedBlockThis instance will call Profiler::begin() when constructed and Profiler::end() when it goes out of scope
 Cmoveit::tools::Profiler::ScopedStartThis instance will call Profiler::start() when constructed and Profiler::stop() when it goes out of scope. If the profiler was already started, this block's constructor and destructor take no action
 Cmoveit_sensor_manager::SensorInfoDefine the frame of reference and the frustum of a sensor (usually this is a visual sensor)
 Ctrajectory_processing::SingleJointTrajectory
 CKDL::SolverI [external]
 CTest
 CTestAction
 Cmoveit::tools::Profiler::TimeInfoInformation about time spent in a section of the code
 Cmoveit::core::VariableBounds
 Cdistance_field::VoxelGrid< T >VoxelGrid holds a dense 3D, axis-aligned set of data at a given resolution, where the data is supplied as a template parameter
 Cdistance_field::VoxelGrid< distance_field::PropDistanceFieldVoxel >
 Ccollision_detection::WorldMaintain a representation of the environment
 Ccollision_detection::WorldDiffMaintain a diff list of changes that have happened to a World


moveit_core
Author(s): Ioan Sucan , Sachin Chitta , Acorn Pooley
autogenerated on Wed Jul 10 2019 04:03:06