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