Class List
Here are the classes, structs, unions and interfaces with brief descriptions:
collision_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
collision_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
moveit::core::AttachedBodyObject defining bodies that can be attached to robot links. This is useful when handling objects picked up by the robot
moveit::tools::Profiler::AvgInfoInformation maintained about averaged values
moveit::tools::BackgroundProcessingThis 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
collision_detection::CollisionData
planning_scene::PlanningScene::CollisionDetector
collision_detection::CollisionDetectorAllocatorAn allocator for a compatible CollisionWorld/CollisionRobot pair
collision_detection::CollisionDetectorAllocatorAllValidAn allocator for AllValid collision detectors
collision_detection::CollisionDetectorAllocatorFCLAn allocator for FCL collision detectors
collision_detection::CollisionDetectorAllocatorTemplate< CollisionWorldType, CollisionRobotType, CollisionDetectorAllocatorType >Template class to make it easy to create an allocator for a specific CollisionWorld/CollisionRobot pair
collision_detection::CollisionGeometryData
collision_detection::CollisionPluginPlugin API for loading a custom collision detection robot/world
collision_detection::CollisionRequestRepresentation of a collision checking request
collision_detection::CollisionResultRepresentation of a collision checking result
collision_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
collision_detection::CollisionRobotAllValid
collision_detection::CollisionRobotFCL
collision_detection::CollisionWorldPerform collision checking with the environment. The collision world maintains a representation of the environment that the robot is operating in
collision_detection::CollisionWorldAllValid
collision_detection::CollisionWorldFCL
distance_field::compareEigen_Vector3iStruct for sorting type Eigen::Vector3i for use in sorted std containers. Sorts in z order, then y order, then x order
kinematic_constraints::ConstraintEvaluationResultStruct for containing the results of constraint evaluation
constraint_samplers::ConstraintSamplerConstraintSampler is an abstract base class that allows the sampling of a kinematic state for a particular group of a robot
constraint_samplers::ConstraintSamplerAllocator
constraint_samplers::ConstraintSamplerManagerThis class assists in the generation of a ConstraintSampler for a particular group from a moveit_msgs::Constraints
moveit::ConstructExceptionThis may be thrown during construction of objects if errors occur
collision_detection::ContactDefinition of a contact point
moveit_controller_manager::MoveItControllerManager::ControllerStateEach controller known to MoveIt has a state. This structure describes that controller's state
collision_detection::CostSourceWhen collision costs are computed, this structure contains information about the partial cost incurred in a particular volume
distance_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
dynamics_solver::DynamicsSolver
EIGEN_MAKE_ALIGNED_OPERATOR_NEWROS/KDL based interface for the inverse kinematics of the PR2 arm
moveit::ExceptionThis may be thrown if unrecoverable errors occur
moveit_controller_manager::ExecutionStatusThe reported execution status
FclCollisionDetectionTester
collision_detection::FCLGeometry
collision_detection::FCLManager
collision_detection::FCLObject
collision_detection::FCLShapeCache
moveit::core::FixedJointModelA fixed joint
moveit::core::FloatingJointModelA floating joint
moveit::core::JointModelGroup::GroupMimicUpdate
collision_detection::IfSameType< T1, T2 >
collision_detection::IfSameType< T, T >
constraint_samplers::IKConstraintSamplerA class that allows the sampling of IK constraints
constraint_samplers::IKSamplingPoseA structure for potentially holding a position constraint and an orientation constraint for use during Ik Sampling
trajectory_processing::IterativeParabolicTimeParameterizationThis class modifies the timestamps of a trajectory to respect velocity and acceleration constraints
kinematic_constraints::JointConstraintClass for handling single DOF joint constraints
constraint_samplers::JointConstraintSamplerJointConstraintSampler is a class that allows the sampling of joints in a particular group of the robot, subject to a set of individual joint constraints
constraint_samplers::JointConstraintSampler::JointInfoAn internal structure used for maintaining constraints on a particular joint
moveit::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
moveit::core::JointModelGroup
kinematic_constraints::KinematicConstraintBase class for representing a kinematic constraint
kinematic_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
kinematics::KinematicsBaseProvides an interface for kinematics solvers
kinematics_metrics::KinematicsMetricsCompute different kinds of metrics for kinematics evaluation. Currently includes manipulability
kinematics::KinematicsQueryOptionsA set of options for the kinematics solver
kinematics::KinematicsResult
moveit::core::JointModelGroup::KinematicsSolver
moveit::core::LinkModelA link from the robot. Contains the constant transform applied to the link and its geometry
LoadPlanningModelsPr2
planning_interface::MotionPlanDetailedResponse
planning_interface::MotionPlanResponse
moveit_controller_manager::MoveItControllerHandleMoveIt sends commands to a controller via a handle that satisfies this interface
moveit_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
moveit_sensor_manager::MoveItSensorManager
collision_detection::World::ObjectA representation of an object
collision_detection::World::Observer
collision_detection::World::ObserverHandle
constraint_samplers::OrderSamplers
kinematic_constraints::OrientationConstraintClass for constraints on the orientation of a link
moveit::tools::Profiler::PerThreadInformation to be maintained for each thread
moveit::core::PlanarJointModelA planar joint
planning_interface::PlannerConfigurationSettingsSpecify the settings for a particular planning algorithm, for a particular group. The Planner plugin uses these settings to configure the algorithm
planning_interface::PlannerManagerBase class for a MoveIt planner
planning_interface::PlanningContextRepresentation of a particular planning context -- the planning scene and the request are known, solution is not yet computed
planning_request_adapter::PlanningRequestAdapter
planning_request_adapter::PlanningRequestAdapterChainApply a sequence of adapters to a motion plan
planning_scene::PlanningSceneThis class maintains the representation of the environment as seen by a planning instance. The environment geometry, the robot geometry and state are maintained
kinematic_constraints::PositionConstraintClass for constraints on the XYZ position of a link
pr2_arm_kinematics::PR2ArmIK
pr2_arm_kinematics::PR2ArmIKSolver
pr2_arm_kinematics::PR2ArmKinematicsPlugin
moveit::core::PrismaticJointModelA prismatic joint
moveit::tools::Profiler
distance_field::PropagationDistanceFieldA 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
distance_field::PropDistanceFieldVoxelStructure that holds voxel information for the DistanceField. Will be used in VoxelGrid
moveit::core::RevoluteJointModelA revolute joint
moveit::core::RobotModelDefinition of a kinematic model. This class is not thread safe, however multiple instances can be created
moveit::core::RobotStateRepresentation of a robot's state. This includes position, velocity, acceleration and effort
robot_trajectory::RobotTrajectoryMaintain a sequence of waypoints and the time durations between these waypoints
planning_scene::SceneTransforms
moveit::tools::Profiler::ScopedBlockThis instance will call Profiler::begin() when constructed and Profiler::end() when it goes out of scope
moveit::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
moveit_sensor_manager::SensorInfoDefine the frame of reference and the frustum of a sensor (usually this is a visual sensor)
TestAction
moveit::tools::Profiler::TimeInfoInformation about time spent in a section of the code
moveit::core::TransformsProvides 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
constraint_samplers::UnionConstraintSamplerThis class exists as a union of constraint samplers. It contains a vector of constraint samplers, and will sample from each of them
moveit::core::VariableBounds
kinematic_constraints::VisibilityConstraintClass for constraints on the visibility relationship between a sensor and a target
distance_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
collision_detection::WorldMaintain a representation of the environment
collision_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 Mon Jul 24 2017 02:20:45