 boost | Modifications controlling boost library behavior |
 cppexamples | |
  CustomController | |
   PIDXMLReader | |
   XMLData | |
  OpenRAVECamera | |
  OpenCVExample | |
  ConveyorBeltModule | Holds a registered set of bodies, at every time step creates new bodies and moves them along a trajectory |
  ConveyorExample | |
  OpenRAVEExample | A simple framework for running C++ examples |
  MultiControlExample | |
  MultithreadedPlanningExample | |
  DoorConfiguration | Builds up the configuration space of a robot and a door |
  PlanningDoorExample | |
  PlanningIkExample | |
  PlanningModuleExample | |
  PlanningPlannerExample | Builds up the configuration space of multiple robots |
  PR2TurnLevelExample | |
  FunctionUserData | |
  PythonBindingModule | |
  ShowSensorsExample | |
  TrajectoryExample | |
  MyModule | |
 ikfast | |
  IkSingleDOFSolutionBase | Holds the solution for a single dof |
  IkSolutionBase | The discrete solutions are returned in this structure |
  IkSolutionListBase | Manages all the solutions |
  IkFastFunctions | Holds function pointers for all the exported functions of ikfast |
  IkSolution | Default implementation of IkSolutionBase |
  IkSolutionList | Default implementation of IkSolutionListBase |
 OpenRAVE | The entire OpenRAVE library |
  geometry | Templated math and geometric functions |
   RaveVector | Vector class containing 4 dimensions |
   RaveTransform | Affine transformation parameterized with quaterions |
   RaveTransformMatrix | Affine transformation parameterized with rotation matrices. Scales and shears are not supported |
   ray | A ray defined by an origin and a direction |
   aabb | An axis aligned bounding box |
   OrientedBox | An oriented bounding box |
   obb | An oriented bounding box |
   triangle | A triangle defined by 3 points |
   frustum | A pyramid with its vertex clipped |
   RaveCameraIntrinsics | Intrinsic parameters for a camera |
  LocalXML | |
   XMLREADERDATA | |
  mathextra | Extra math routines that are useful to have but don't really belong anywhere |
  planningutils | |
   ActiveDOFTrajectorySmoother | Smoother planner for the trajectory points to avoiding collisions by extracting and using the currently set active dofs of the robot |
   ActiveDOFTrajectoryRetimer | Retimer planner the trajectory points by extracting and using the currently set active dofs of the robot. [multi-thread safe] |
   AffineTrajectoryRetimer | Retimer planner the trajectory points consisting of affine transformation values while avoiding collisions. [multi-thread safe] |
   DHParameter | DH parameters for one joint |
   LineCollisionConstraint | Line collision |
   SimpleDistanceMetric | Simple distance metric based on joint weights |
   SimpleNeighborhoodSampler | Samples the neighborhood of a configuration using the configuration space distance metric and sampler |
   ManipulatorIKGoalSampler | Samples numsamples of solutions and each solution to vsolutions |
    SampleInfo | |
   TrajectoryVerifier | |
   PlannerStateSaver | |
  utils | |
   null_deleter | |
   index_cmp | |
   smart_pointer_deleter | Allow to add different custom deleter funtions to a shared_ptr without touching its original custom deleter |
  xmlreaders | |
   StringXMLReadable | |
   HierarchicalXMLReadable | Maintains a hierarchy of classes each containing the xml attributes and data |
   TrajectoryReader | Create a xml parser for trajectories |
   GeometryInfoReader | Create a xml parser for trajectories |
   HierarchicalXMLReader | Reads and stores the infromation hierarchically |
   StreamXMLWriter | |
  CollisionReport | Holds information about a particular collision that occured |
   CONTACT | |
  CollisionCheckerBase | [interface] Responsible for all collision checking queries of the environment. If not specified, method is not multi-thread safe. See Collision Checker Concepts |
  CollisionOptionsStateSaver | Helper class to save and restore the collision options. If options are not supported and required is true, throws an exception |
  ControllerBase | [interface] Abstract base class to encapsulate a local controller. If not specified, method is not multi-thread safe. See Controller Concepts |
  MultiController | Controller that manage multiple controllers, allows users to easily set multiple controllers for one robot |
  EnvironmentBase | Maintains a world state, which serves as the gateway to all functions offered through OpenRAVE. See Environment Concepts |
  IkReturn | |
  IkSolverBase | [interface] Base class for all Inverse Kinematic solvers. If not specified, method is not multi-thread safe. See Inverse Kinematics Solver Concepts |
  InterfaceBase | [interface] Base class for all interfaces that OpenRAVE provides. See Base Interface Concepts |
   InterfaceCommand | |
  KinBody | [interface] A kinematic body of links and joints. If not specified, method is not multi-thread safe. See Kinematics Body Concepts |
   BodyState | Stores the state of the current body that is published in a thread safe way from the environment without requiring locking the environment |
   GeometryInfo | Describes the properties of a geometric primitive |
   Joint | Information about a joint that controls the relationship between two links |
   JointInfo | Describes the properties of a joint used to initialize it |
   KinBodyStateSaver | Helper class to save and restore the entire kinbody state |
   Link | A rigid body holding all its collision and rendering data |
    Geometry | Geometry object holding a link parent and wrapping access to a protected geometry info |
   LinkInfo | Describes the properties of a link used to initialize it |
   ManageData | Access point of the sensor system that manages the body |
   Mimic | |
    DOFFormat | |
    DOFHierarchy | |
   MimicInfo | Holds mimic information about position, velocity, and acceleration of one axis of the joint |
  ModuleBase | [interface] A loadable module of user code meant to solve a specific domain. If not specified, method is not multi-thread safe. See Module Concepts |
  openrave_exception | Exception that all OpenRAVE internal methods throw; the error codes are held in OpenRAVEErrorCode |
  CaseInsensitiveCompare | |
  UserData | Base class for all user data |
  SerializableData | User data that can serialize/deserialize itself |
  XMLReadable | Base class for readable interfaces |
  BaseXMLReader | Base class for all xml readers. XMLReaders are used to process data from xml files |
  DummyXMLReader | Reads until the tag ends |
  BaseXMLWriter | Base class for writing to XML files |
  ConfigurationSpecification | A configuration specification references values in the environment that then define a configuration-space which can be searched for |
   Group | A group referencing the values of one body in the environment |
   Reader | |
  IkParameterization | Parameterization of basic primitives for querying inverse-kinematics solutions |
  TriMesh | User data for trimesh geometries. Vertices are defined in counter-clockwise order for outward pointing faces |
  PhysicsEngineBase | [interface] The physics engine interfaces supporting simulations and dynamics. See Physics Engine Concepts |
  PlannerBase | [interface] Planner interface that generates trajectories for target objects to follow through the environment. If not specified, method is not multi-thread safe. See Planner Concepts |
   PlannerParameters | Describes a common and serializable interface for planning parameters |
    StateSaver | Saves and restores the state using PlannerParameters::_setstatefn and PlannerParameters::_getstatefn |
   PlannerProgress | Planner progress information passed to each callback function |
  ExplorationParameters | |
  RAStarParameters | |
  GraspSetParameters | |
  GraspParameters | |
  TrajectoryTimingParameters | Parameters for timing/smoothing trajectories |
  ConstraintTrajectoryTimingParameters | |
  WorkspaceTrajectoryParameters | |
  RRTParameters | |
  BasicRRTParameters | |
  PLUGININFO | Holds all the OpenRAVE-specific information provided by a plugin |
  RobotBase | [interface] A robot is a kinematic body that has attached manipulators, sensors, and controllers. If not specified, method is not multi-thread safe. See Robot Concepts |
   AttachedSensor | Attaches a sensor to a link on the robot |
   AttachedSensorInfo | Holds all user-set attached sensor information used to initialize the AttachedSensor class |
   GrabbedInfo | Holds all user-set attached sensor information used to initialize the AttachedSensor class |
   Manipulator | Defines a chain of joints for an arm and set of joints for a gripper. Simplifies operating with them |
   ManipulatorInfo | Holds all user-set manipulator information used to initialize the Manipulator class |
   RobotStateSaver | Helper class derived from KinBodyStateSaver to additionaly save robot information |
  SensorBase | [interface] A sensor measures physical properties from the environment. If not specified, method is not multi-thread safe. See Sensor Concepts |
   ActuatorGeomData | |
   ActuatorSensorData | An actuator for modeling motors and other mechanisms that produce torque/force. The actuator has only one degree of freedom |
   CameraGeomData | |
   CameraSensorData | |
   Force6DGeomData | |
   Force6DSensorData | Stores force data |
   IMUGeomData | |
   IMUSensorData | Stores IMU data |
   JointEncoderGeomData | |
   JointEncoderSensorData | Stores joint angles and EE position |
   LaserGeomData | |
   LaserSensorData | |
   OdometryGeomData | |
   OdometrySensorData | Odometry data storing full 6D pose and velocity |
   SensorData | Used to pass sensor data around |
   SensorGeometry | Permanent properties of the sensors |
   TactileGeomData | |
    Friction | LuGre friction model? |
   TactileSensorData | Tactle data |
  SensorSystemBase | [interface] Used to manage the creation and destruction of bodies. See Sensor System Concepts |
  SimpleSensorSystem | A very simple sensor system example that manages raw detection data |
   BodyData | |
   SimpleXMLReader | |
   XMLData | |
  SpaceSamplerBase | [interface] Contains space samplers commonly used in planners. If not specified, method is not multi-thread safe. See SpaceSampler Concepts |
  TrajectoryBase | [interface] Encapsulate a time-parameterized trajectories of robot configurations. If not specified, method is not multi-thread safe. Trajectory Concepts |
   Point | |
  GraphHandle | Handle holding the plot from the viewers. The plot will continue to be drawn as long as a reference to this handle is held |
  ViewerBase | [interface] Base class for the graphics and gui engine that renders the environment and provides visual sensor information. If not specified, method is not multi-thread safe. See Viewer Concepts |
  CustomIkSolverFilterData | |
  ChangeCallbackData | |
  RaveGlobal | |
   XMLReaderFunctionData | |
  CustomPlannerCallbackData | |
  CallOnDestruction | |
 RaveTransform | |
 RaveTransformMatrix | |