►Coctomap::AbstractOcTree [external] | |
►Coctomap::AbstractOccupancyOcTree [external] | |
►COcTreeBaseImpl< OcTreeNode, AbstractOccupancyOcTree > [external] | |
►COccupancyOcTreeBase< OcTreeNode > [external] | |
►Coctomap::OcTree [external] | |
Ccollision_detection::OccMapTree | |
Ccollision_detection::World::Action | Represents 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 | |
Cmoveit::core::AABB | Represents an axis-aligned bounding box |
Ccollision_detection::AllowedCollisionMatrix | Definition of a structure for the allowed collision matrix |
Cmoveit::core::AttachedBody | Object defining bodies that can be attached to robot links |
Cmoveit::tools::Profiler::AvgInfo | Information maintained about averaged values |
Ccollision_detection::BodyDecomposition | |
Ccollision_detection::BodyDecompositionCache | |
Ccollision_detection_bullet::BroadphaseContactResultCallback | Callback structure for both discrete and continuous broadphase collision pair |
►CbtCollisionObject | |
Ccollision_detection_bullet::CollisionObjectWrapper | Tesseract bullet collision object |
►CbtConvexShape | |
Ccollision_detection_bullet::CastHullShape | Casted collision shape used for checking if an object is collision free between two discrete poses |
►CbtManifoldResult | |
Ccollision_detection_bullet::TesseractBroadphaseBridgedManifoldResult | |
►CbtOverlapCallback | |
Ccollision_detection_bullet::TesseractCollisionPairCallback | A callback function that is called as part of the broadphase collision checking |
►CbtOverlapFilterCallback | |
Ccollision_detection_bullet::BroadphaseFilterCallback | |
►Ccollision_detection_bullet::BulletBVHManager | A bounding volume hierarchy (BVH) implementation of a tesseract contact manager |
Ccollision_detection_bullet::BulletCastBVHManager | A bounding volume hierarchy (BVH) implementation of a tesseract contact manager |
Ccollision_detection_bullet::BulletDiscreteBVHManager | A bounding volume hierarchy (BVH) implementaiton of a discrete bullet manager |
Cmoveit::core::CartesianInterpolator | |
Cmoveit::core::CartesianPrecision | |
►CChainIkSolverPos | |
Cpr2_arm_kinematics::PR2ArmIKSolver | |
Ccollision_detection::CollisionData | Data structure which is passed to the collision callback function of the collision manager |
Cplanning_scene::PlanningScene::CollisionDetector | |
►Ccollision_detection::CollisionDetectorAllocator | An allocator for a compatible CollisionWorld/CollisionRobot pair |
Ccollision_detection::CollisionDetectorAllocatorTemplate< CollisionEnvType, CollisionDetectorAllocatorType > | Template class to make it easy to create an allocator for a specific CollisionWorld/CollisionRobot pair |
►Ccollision_detection::CollisionDetectorAllocatorTemplate< CollisionEnvAllValid, CollisionDetectorAllocatorAllValid > | |
Ccollision_detection::CollisionDetectorAllocatorAllValid | An allocator for AllValid collision detectors |
►Ccollision_detection::CollisionDetectorAllocatorTemplate< CollisionEnvBullet, CollisionDetectorAllocatorBullet > | |
Ccollision_detection::CollisionDetectorAllocatorBullet | An allocator for Bullet collision detectors |
►Ccollision_detection::CollisionDetectorAllocatorTemplate< CollisionEnvDistanceField, CollisionDetectorAllocatorDistanceField > | |
Ccollision_detection::CollisionDetectorAllocatorDistanceField | An allocator for Distance Field collision detectors |
►Ccollision_detection::CollisionDetectorAllocatorTemplate< CollisionEnvFCL, CollisionDetectorAllocatorFCL > | |
Ccollision_detection::CollisionDetectorAllocatorFCL | An allocator for FCL collision detectors |
►Ccollision_detection::CollisionDetectorAllocatorTemplate< CollisionEnvHybrid, CollisionDetectorAllocatorHybrid > | |
Ccollision_detection::CollisionDetectorAllocatorHybrid | An allocator for Hybrid collision detectors |
►Ccollision_detection::CollisionEnv | Provides the interface to the individual collision checking libraries |
Ccollision_detection::CollisionEnvAllValid | Collision environment which always just returns no collisions |
Ccollision_detection::CollisionEnvBullet |
|
Ccollision_detection::CollisionEnvDistanceField | |
►Ccollision_detection::CollisionEnvFCL | FCL implementation of the CollisionEnv |
Ccollision_detection::CollisionEnvHybrid | This hybrid collision environment combines FCL and a distance field. Both can be used to calculate collisions |
Ccollision_detection::CollisionGeometryData | Wrapper around world, link and attached objects' geometry data |
►Ccollision_detection::CollisionPlugin | Plugin API for loading a custom collision detection robot/world |
Ccollision_detection::CollisionDetectorBtPluginLoader | |
Ccollision_detection::CollisionDetectorFCLPluginLoader | |
Ccollision_detection::CollisionPluginCache | |
Ccollision_detection::CollisionPluginCache::CollisionPluginCacheImpl | |
Ccollision_detection::CollisionRequest | Representation of a collision checking request |
Ccollision_detection::CollisionResult | Representation of a collision checking result |
Ccollision_detection::CollisionSphere | |
Cdistance_field::CompareEigenVector3i | Struct for sorting type Eigen::Vector3i for use in sorted std containers. Sorts in z order, then y order, then x order |
Ckinematic_constraints::ConstraintEvaluationResult | Struct for containing the results of constraint evaluation |
►Cconstraint_samplers::ConstraintSampler | ConstraintSampler is an abstract base class that allows the sampling of a kinematic state for a particular group of a robot |
Cconstraint_samplers::IKConstraintSampler | A class that allows the sampling of IK constraints |
Cconstraint_samplers::JointConstraintSampler | JointConstraintSampler is a class that allows the sampling of joints in a particular group of the robot, subject to a set of individual joint constraints |
Cconstraint_samplers::UnionConstraintSampler | This class exists as a union of constraint samplers. It contains a vector of constraint samplers, and will sample from each of them |
Cconstraint_samplers::ConstraintSamplerAllocator | |
Cconstraint_samplers::ConstraintSamplerManager | This class assists in the generation of a ConstraintSampler for a particular group from a moveit_msgs::Constraints |
Ccollision_detection::Contact | Definition of a contact point |
Ccollision_detection_bullet::ContactTestData | Bundles the data for a collision query |
Cmoveit_controller_manager::MoveItControllerManager::ControllerState | Each controller known to MoveIt has a state. This structure describes that controller's state |
Ccollision_detection::CostSource | When collision costs are computed, this structure contains information about the partial cost incurred in a particular volume |
Ccollision_detection::DistanceData | Data structure which is passed to the distance callback function of the collision manager |
►Cdistance_field::DistanceField | DistanceField 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 |
►Cdistance_field::PropagationDistanceField | A DistanceField implementation that uses a vector propagation method. Distances propagate outward from occupied cells, or inwards from unoccupied cells if negative distances are to be computed, which is optional. Outward and inward propagation only occur to a desired maximum distance - cells that are more than this maximum distance from the nearest cell will have maximum distance measurements |
Ccollision_detection::PosedDistanceField | |
Ccollision_detection::DistanceFieldCacheEntry | |
Ccollision_detection::CollisionEnvDistanceField::DistanceFieldCacheEntryWorld | |
Ccollision_detection::DistanceRequest | Representation of a distance-reporting request |
Ccollision_detection::DistanceResult | Result of a distance request |
Ccollision_detection::DistanceResultsData | Generic representation of the distance information for a pair of objects |
Cpybind11::detail::DurationCaster< T > | Convert ros::Duration / ros::WallDuration into a float |
►Cpybind11::detail::DurationCaster< ros::Duration > | |
Cpybind11::detail::type_caster< ros::Duration > | |
►Cpybind11::detail::DurationCaster< ros::WallDuration > | |
Cpybind11::detail::type_caster< ros::WallDuration > | |
Cdynamics_solver::DynamicsSolver | |
►Cenable_shared_from_this | |
Cplanning_scene::PlanningScene | This class maintains the representation of the environment as seen by a planning instance. The environment geometry, the robot geometry and state are maintained |
Cmoveit_controller_manager::ExecutionStatus | The reported execution status |
Ccollision_detection::FCLGeometry | Bundles the CollisionGeometryData and FCL collision geometry representation into a single class |
Ccollision_detection::FCLManager | Bundles an FCLObject and a broadphase FCL collision manager |
Ccollision_detection::FCLObject | A general high-level object which consists of multiple FCLCollisionObjects. It is the top level data structure which is used in the collision checking process |
Ccollision_detection::FCLShapeCache | Cache for an arbitrary type of shape. It is assigned during the execution of createCollisionGeometry() |
►CFixture | |
CRobotStateBenchmark | |
Ccollision_detection::GradientInfo | |
Cmoveit::core::JointModelGroup::GroupMimicUpdate | |
Ccollision_detection::GroupStateRepresentation | |
Cconstraint_samplers::IKSamplingPose | A structure for potentially holding a position constraint and an orientation constraint for use during Ik Sampling |
CIsApprox< T1, T2 > | |
Ctrajectory_processing::IterativeTorqueLimitParameterization | |
Cconstraint_samplers::JointConstraintSampler::JointInfo | An internal structure used for maintaining constraints on a particular joint |
►Cmoveit::core::JointModel | A 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::FixedJointModel | A fixed joint |
Cmoveit::core::FloatingJointModel | A floating joint |
Cmoveit::core::PlanarJointModel | A planar joint |
Cmoveit::core::PrismaticJointModel | A prismatic joint |
Cmoveit::core::RevoluteJointModel | A revolute joint |
Cmoveit::core::JointModelGroup | |
Cmoveit::core::JumpThreshold | Struct for containing jump_threshold |
►Ckinematic_constraints::KinematicConstraint | Base class for representing a kinematic constraint |
Ckinematic_constraints::JointConstraint | Class for handling single DOF joint constraints |
Ckinematic_constraints::OrientationConstraint | Class for constraints on the orientation of a link |
Ckinematic_constraints::PositionConstraint | Class for constraints on the XYZ position of a link |
Ckinematic_constraints::VisibilityConstraint | Class for constraints on the visibility relationship between a sensor and a target |
Ckinematic_constraints::KinematicConstraintSet | A 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::KinematicsBase | Provides an interface for kinematics solvers |
Cpr2_arm_kinematics::PR2ArmKinematicsPlugin | |
Ckinematics_metrics::KinematicsMetrics | Compute different kinds of metrics for kinematics evaluation. Currently includes manipulability |
Ckinematics::KinematicsQueryOptions | A set of options for the kinematics solver |
Ckinematics::KinematicsResult | |
Cmoveit::core::JointModelGroup::KinematicsSolver | |
Cmoveit::core::LinkModel | A link from the robot. Contains the constant transform applied to the link and its geometry |
Cmoveit::core::MaxEEFStep | Struct for containing max_step for computeCartesianPath |
Cplanning_interface::MotionPlanDetailedResponse | |
Cplanning_interface::MotionPlanResponse | |
Cmoveit_controller_manager::MoveItControllerHandle | MoveIt sends commands to a controller via a handle that satisfies this interface |
Cmoveit_controller_manager::MoveItControllerManager | MoveIt 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 |
►CMoveItErrorCodes | |
Cmoveit::core::MoveItErrorCode | Wrapper around moveit_msgs::MoveItErrorCodes to make it easier to return an error code message from a function |
Cmoveit_sensor_manager::MoveItSensorManager | |
►Cnoncopyable | |
►Cmoveit::core::Transforms | Provides an implementation of a snapshot of a transform tree that can be easily queried for transforming different quantities. Transforms are maintained as a list of transforms to a particular frame. All stored transforms are considered fixed |
Cplanning_scene::SceneTransforms | |
Cmoveit::tools::BackgroundProcessing | This class provides simple API for executing background jobs. A queue of jobs is created and the specified jobs are executed in order, one at a time |
Cmoveit::tools::Profiler | |
Cplanning_scene::PlanningScene | This class maintains the representation of the environment as seen by a planning instance. The environment geometry, the robot geometry and state are maintained |
Ccollision_detection::World::Object | A representation of an object |
Ccollision_detection::World::Observer | |
Ccollision_detection::World::ObserverHandle | |
Cconstraint_samplers::OrderSamplers | |
Ctrajectory_processing::Path | |
►Ctrajectory_processing::PathSegment | |
Ctrajectory_processing::CircularPathSegment | |
Ctrajectory_processing::LinearPathSegment | |
Cmoveit::tools::Profiler::PerThread | Information to be maintained for each thread |
Cplanning_interface::PlannerConfigurationSettings | Specify the settings for a particular planning algorithm, for a particular group. The Planner plugin uses these settings to configure the algorithm |
►Cplanning_interface::PlannerManager | Base class for a MoveIt planner |
CPlannerManagerStub | |
►Cplanning_interface::PlanningContext | Representation of a particular planning context – the planning scene and the request are known, solution is not yet computed |
CPlanningContextStub | |
►Cplanning_request_adapter::PlanningRequestAdapter | |
CAppendingPlanningRequestAdapter | |
CPrependingPlanningRequestAdapter | |
Cplanning_request_adapter::PlanningRequestAdapterChain | Apply 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::PropDistanceFieldVoxel | Structure that holds voxel information for the DistanceField. Will be used in VoxelGrid |
Ccollision_detection::ProximityInfo | |
Cmoveit::core::RobotModel | Definition of a kinematic model. This class is not thread safe, however multiple instances can be created |
Cmoveit::core::RobotModelBuilder | Easily build different robot models for testing. Essentially a programmer-friendly light wrapper around URDF and SRDF. Best shown by an example: |
Cmoveit::core::RobotState | Representation of a robot's state. This includes position, velocity, acceleration and effort |
Crobot_trajectory::RobotTrajectory | Maintain a sequence of waypoints and the time durations between these waypoints |
Ctrajectory_processing::RuckigSmoothing | |
►Cruntime_error | |
Cmoveit::ConstructException | This may be thrown during construction of objects if errors occur |
Cmoveit::Exception | This may be thrown if unrecoverable errors occur |
Cmoveit::tools::Profiler::ScopedBlock | This instance will call Profiler::begin() when constructed and Profiler::end() when it goes out of scope |
Cmoveit::tools::Profiler::ScopedStart | This 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::SensorInfo | Define the frame of reference and the frustum of a sensor (usually this is a visual sensor) |
Ctrajectory_processing::SingleJointTrajectory | |
►CTest | |
CBulletCollisionDetectionTester | |
CCollisionDetectionEnvTest | |
►CCollisionDetectorPandaTest< CollisionAllocatorType > | |
►CDistanceCheckPandaTest< CollisionAllocatorType > | |
CDistanceFullPandaTest< CollisionAllocatorType > | |
CCollisionDetectorTest< CollisionAllocatorType > | |
CDistanceFieldCollisionDetectionTester | |
CFloatingJointRobot | |
CLoadPlanningModelsPr2 | |
COneRobot | |
CPandaRobot | |
CPlanningRequestAdapterTests | |
CRobotTrajectoryTestFixture | |
CSimplePlanarRobot | |
CSimpleRobot | |
CSphericalRobot | |
CTestAABB | |
CTestAction | |
►CTestWithParam | |
CCollisionDetectorTests | |
Cmoveit::tools::Profiler::TimeInfo | Information about time spent in a section of the code |
►Ctrajectory_processing::TimeParameterization | |
Ctrajectory_processing::IterativeParabolicTimeParameterization | |
Ctrajectory_processing::IterativeSplineParameterization | This 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 |
Ctrajectory_processing::TimeOptimalTrajectoryGeneration | |
Ctrajectory_processing::Trajectory | |
Ctrajectory_processing::Trajectory::TrajectoryStep | |
Cpybind11::detail::type_caster< T, enable_if_t< ros::message_traits::IsMessage< T >::value > > | Convert ROS message types (C++ <-> python) |
Cmoveit::core::VariableBounds | |
Cfcl::details::Vec3Data< T > | |
Cfcl::Vec3fX< T > | |
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::World | Maintain a representation of the environment |
Ccollision_detection::WorldDiff | Maintain a diff list of changes that have happened to a World |