 boost | |
 gazebo | Forward declarations for the common classes |
  common | Common namespace |
   Animation | Manages an animation, which is a collection of keyframes and the ability to interpolate between the keyframes |
   AssertionInternalError | Class for generating Exceptions which come from gazebo assertions |
   AudioDecoder | An audio decoder based on FFMPEG |
   BVHLoader | Handles loading BVH animation files |
   ColladaLoader | Class used to load Collada mesh files |
   Color | Defines a color |
   Console | Container for loggers, and global logging options (such as verbose vs |
   Dem | |
   DemPrivate | Private data for the Dem class |
   Exception | Class for generating exceptions |
   FileLogger | A logger that outputs messages to a file |
    Buffer | String buffer for the file logger |
   HeightmapData | Encapsulates a generic heightmap data file |
   Image | Encapsulates an image |
   ImageHeightmap | Encapsulates an image that will be interpreted as a heightmap |
   InternalError | Class for generating Internal Gazebo Errors: those errors which should never happend and represent programming bugs |
   KeyEvent | Generic description of a keyboard event |
   KeyFrame | A key frame in an animation |
   Logger | Terminal logger |
    Buffer | String buffer for the base logger |
   Material | Encapsulates description of a material |
   Mesh | A 3D mesh |
   MeshCSG | Creates CSG meshes |
   MeshLoader | Base class for loading meshes |
   MeshManager | Maintains and manages all meshes |
   ModelDatabase | Connects to model database, and has utility functions to find models |
   ModelDatabasePrivate | Private class attributes for ModelDatabase |
   MouseEvent | Generic description of a mouse event |
   MovingWindowFilter | Base class for MovingWindowFilter |
   MovingWindowFilterPrivate | |
   NodeAnimation | Node animation |
   NodeAssignment | Vertex to node weighted assignement for skeleton animation visualization |
   NodeTransform | NodeTransform Skeleton.hh common/common.hh |
   NumericAnimation | A numeric animation |
   NumericKeyFrame | A keyframe for a NumericAnimation |
   ParamT | |
   PID | Generic PID controller class |
   PoseAnimation | A pose animation |
   PoseKeyFrame | A keyframe for a PoseAnimation |
   Skeleton | A skeleton |
   SkeletonAnimation | Skeleton animation |
   SkeletonNode | A skeleton node |
   SphericalCoordinates | Convert spherical coordinates for planetary surfaces |
   SphericalCoordinatesPrivate | Commmon/common.hh |
   STLLoader | Class used to load STL mesh files |
   SubMesh | A child mesh |
   SystemPaths | Functions to handle getting system paths, keeps track of: |
   Time | A Time class, can be used to hold wall- or sim-time |
   Timer | A timer class, used to time things in real world walltime |
   UpdateInfo | Information for use in an update event |
   Video | Handle video encoding and decoding using libavcodec |
  event | Event namespace |
   Connection | A class that encapsulates a connection |
   ConnectionPrivate | |
   Event | Base class for all events |
   EventPrivate | |
   Events | An Event class to get notifications for simulator events |
   EventT | A class for event processing |
   EventTPrivate | |
  math | Math namespace |
   Angle | An angle and related functions |
   Box | Mathematical representation of a box and related functions |
   Matrix3 | A 3x3 matrix class |
   Matrix4 | A 3x3 matrix class |
   Plane | A plane and related functions |
   Pose | Encapsulates a position and rotation in three space |
   Quaternion | A quaternion class |
   Rand | Random number generator class |
   RotationSpline | Spline for rotations |
   Spline | Splines |
   Vector2d | Generic double x, y vector |
   Vector2i | Generic integer x, y vector |
   Vector3 | Generic vector containing 3 elements |
   Vector4 | Double Generic x, y, z, w vector |
  msgs | Messages namespace |
   MsgFactory | A factory that generates protobuf message based on a string type |
  physics | Namespace for physics |
   Actor | Actor class enables GPU based mesh model / skeleton scriptable animation |
   BallJoint | Base class for a ball joint |
   Base | Base class for most physics classes |
   BoxShape | Box geometry primitive |
   Collision | Base class for all collision entities |
   CollisionState | Store state information of a physics::Collision object |
   Contact | A contact between two collisions |
   ContactManager | Aggregates all the contact information generated by the collision detection engine |
   ContactPublisher | A custom contact publisher created for each contact filter in the Contact Manager |
   CylinderShape | Cylinder collision |
   DARTBallJoint | An DARTBallJoint |
   DARTBoxShape | DART Box shape |
   DARTCollision | Base class for all DART collisions |
   DARTCylinderShape | DART cylinder shape |
   DARTHeightmapShape | DART Height map collision |
   DARTHinge2Joint | A two axis hinge joint |
   DARTHingeJoint | A single axis hinge joint |
   DARTJoint | DART joint interface |
   DARTLink | DART Link class |
   DARTMeshShape | Triangle mesh collision |
   DARTModel | DART model class |
   DARTMultiRayShape | DART specific version of MultiRayShape |
   DARTPhysics | DART physics engine |
   DARTPlaneShape | An DART Plane shape |
   DARTRayShape | Ray collision |
   DARTScrewJoint | A screw joint |
   DARTSliderJoint | A slider joint |
   DARTSphereShape | A DART sphere shape |
   DARTTypes | A set of functions for converting between the math types used by gazebo and dart |
   DARTUniversalJoint | A universal joint |
   Entity | Base class for all physics objects in Gazebo |
   FrictionPyramid | Parameters used for friction pyramid model |
   GearboxJoint | A double axis gearbox joint |
   Gripper | A gripper abstraction |
   HeightmapShape | HeightmapShape collision shape builds a heightmap from an image |
   Hinge2Joint | A two axis hinge joint |
   HingeJoint | A single axis hinge joint |
   Inertial | A class for inertial information about a link |
   Joint | Base class for all joints |
   JointController | A class for manipulating physics::Joint |
   JointControllerPrivate | |
   JointState | Keeps track of state of a physics::Joint |
   JointWrench | Wrench information from a joint |
   Link | Link class defines a rigid body entity, containing information on inertia, visual and collision properties of a rigid body |
   LinkState | Store state information of a physics::Link object |
   MapShape | Creates box extrusions based on an image |
   MeshShape | Triangle mesh collision shape |
   Model | A model is a collection of links, joints, and plugins |
   ModelState | Store state information of a physics::Model object |
   MultiRayShape | Laser collision contains a set of ray-collisions, structured to simulate a laser range scanner |
   PhysicsEngine | Base class for a physics engine |
   PhysicsFactory | The physics factory instantiates different physics engines |
   PlaneShape | Collision for an infinite plane |
   RayShape | Base class for Ray collision geometry |
   Road | For building a Road from SDF |
   ScrewJoint | A screw joint, which has both prismatic and rotational DOFs |
   Shape | Base class for all shapes |
   SimbodyBallJoint | SimbodyBallJoint class models a ball joint in Simbody |
   SimbodyBoxShape | Simbody box collision |
   SimbodyCollision | Simbody collisions |
   SimbodyCylinderShape | Cylinder collision |
   SimbodyHeightmapShape | Height map collision |
   SimbodyHinge2Joint | A two axis hinge joint |
   SimbodyHingeJoint | A single axis hinge joint |
   SimbodyJoint | Base class for all joints |
   SimbodyLink | Simbody Link class |
   SimbodyMeshShape | Triangle mesh collision |
   SimbodyModel | A model is a collection of links, joints, and plugins |
   SimbodyMultiRayShape | Simbody specific version of MultiRayShape |
   SimbodyPhysics | Simbody physics engine |
   SimbodyPlaneShape | Simbody collision for an infinite plane |
   SimbodyRayShape | Ray shape for simbody |
   SimbodyScrewJoint | A screw joint |
   SimbodySliderJoint | A slider joint |
   SimbodySphereShape | Simbody sphere collision |
   SimbodyUniversalJoint | A simbody universal joint class |
   SliderJoint | A slider joint |
   SphereShape | Sphere collision shape |
   State | State of an entity |
   SurfaceParams | SurfaceParams defines various Surface contact parameters |
   TrajectoryInfo | Information about a trajectory for an Actor |
   UniversalJoint | A universal joint |
   World | The world provides access to all other object within a simulated environment |
   WorldState | Store state information of a physics::World object |
  rendering | Rendering namespace |
   ArrowVisual | Basic arrow visualization |
   ArrowVisualPrivate | Private data for the Arrow Visual class |
   AxisVisual | Basic axis visualization |
   AxisVisualPrivate | Private data for the Axis Visual class |
   Camera | Basic camera sensor |
   CameraPrivate | Private data for the Camera class |
   CameraVisual | Basic camera visualization |
   CameraVisualPrivate | |
   COMVisual | Basic Center of Mass visualization |
   COMVisualPrivate | Private data for the COM Visual class |
   ContactVisual | Contact visualization |
   ContactVisualPrivate | Private data for the Arrow Visual class |
    ContactPoint | A contact point visualization |
   Conversions | Conversions Conversions.hh rendering/Conversions.hh |
   DepthCamera | Depth camera used to render depth data into an image buffer |
   DummyPageProvider | Pretends to provide procedural page content to avoid page loading |
   DynamicLines | Class for drawing lines that can change |
   DynamicRenderable | Abstract base class providing mechanisms for dynamically growing hardware buffers |
   Events | Base class for rendering events |
   FPSViewController | First Person Shooter style view controller |
   GpuLaser | GPU based laser distance sensor |
   Grid | Displays a grid of cells, drawn with lines |
   GUIOverlay | A class that creates a CEGUI overlay on a render window |
   GUIOverlayPrivate | Private data for the GUIOverlay class |
   GzTerrainMatGen | |
    SM2Profile | Shader model 2 profile target |
     ShaderHelperCg | Keeping the CG shader for reference |
     ShaderHelperGLSL | Utility class to help with generating shaders for GLSL |
   Heightmap | Rendering a terrain using heightmap information |
   JointVisual | Visualization for joints |
   JointVisualPrivate | Private data for the Joint Visual class |
   LaserVisual | Visualization for laser data |
   LaserVisualPrivate | Private data for the Laser Visual class |
   Light | A light source |
   MovableText | Movable text |
   OrbitViewController | Orbit view controller |
   Projector | Projects a material onto surface, light a light projector |
   RenderEngine | Adaptor to Ogre3d |
   RFIDTagVisual | Visualization for RFID tags sensor |
   RFIDTagVisualPrivate | Private data for the RFID Tag Visual class |
   RFIDVisual | Visualization for RFID sensor |
   RFIDVisualPrivate | Private data for the RFID Visual class |
   Road2d | |
   RTShaderSystem | Implements Ogre's Run-Time Shader system |
   Scene | Representation of an entire scene graph |
   SelectionObj | Interactive selection object for models and links |
   SelectionObjPrivate | Private data for the Selection Obj class |
   SonarVisual | Visualization for sonar data |
   SonarVisualPrivate | Private data for the Sonar Visual class |
   TransmitterVisual | Visualization for the wireless propagation data |
   TransmitterVisualPrivate | Private data for the Transmitter Visual class |
   UserCamera | A camera used for user visualization of a scene |
   UserCameraPrivate | Private data for the UserCamera class |
   VideoVisual | A visual element that displays a video as a texture |
   VideoVisualPrivate | Private data for the Video Visual class |
   ViewController | Base class for view controllers |
   Visual | A renderable object |
   VisualPrivate | Private data for the Visual class |
   WindowManager | Class to mangage render windows |
   WireBox | Draws a wireframe box |
   WireBoxPrivate | Private data for the WireBox class |
   WrenchVisual | Visualization for sonar data |
   WrenchVisualPrivate | Private data for the Wrench Visual class |
  sensors | Sensors namespace |
   CameraSensor | Basic camera sensor |
   ContactSensor | Contact sensor |
   DepthCameraSensor | |
   ForceTorqueSensor | Sensor for measure force and torque on a joint |
   GaussianNoiseModel | Gaussian noise class |
   GpsSensor | GpsSensor to provide position measurement |
   GpuRaySensor | |
   ImageGaussianNoiseModel | |
   ImuSensor | An IMU sensor |
   MultiCameraSensor | Multiple camera sensor |
   Noise | Noise models for sensor output signals |
   NoiseFactory | Use this noise manager for creating and loading noise models |
   RaySensor | Sensor with one or more rays |
   RFIDSensor | Sensor class for RFID type of sensor |
   RFIDTag | RFIDTag to interact with RFIDTagSensors |
   Sensor | Base class for sensors |
   SensorFactory | |
   SensorManager | Class to manage and update all sensors |
   SonarSensor | Sensor with sonar cone |
   WirelessReceiver | Sensor class for receiving wireless signals |
   WirelessTransceiver | Sensor class for receiving wireless signals |
   WirelessTransmitter | Transmitter to send wireless signals |
  transport | |
   CallbackHelper | A helper class to handle callbacks when messages arrive |
   CallbackHelperT | Callback helper Template |
   Connection | Single TCP/IP connection manager |
   ConnectionManager | Manager of connections |
   IOManager | Manages boost::asio IO |
   Node | A node can advertise and subscribe topics, publish on advertised topics and listen to subscribed topics |
   Publication | A publication for a topic |
   PublicationTransport | Transport/transport.hh |
   Publisher | A publisher of messages on a topic |
   RawCallbackHelper | Used to connect publishers to subscribers, where the subscriber wants the raw data from the publisher |
   SubscribeOptions | Options for a subscription |
   Subscriber | A subscriber to a topic |
   SubscriptionTransport | Transport/transport.hh |
   TopicManager | Manages topics and their subscriptions |
  util | |
   DiagnosticManager | A diagnostic manager class |
   DiagnosticTimer | A timer designed for diagnostics |
   LogPlay | |
   LogRecord | Addtogroup gazebo_util |
   OpenAL | 3D audio setup and playback |
   OpenALSink | OpenAL Listener |
   OpenALSource | OpenAL Source |
  Master | A manager that directs topic connections, enables each gazebo network client to locate one another for peer-to-peer communication |
  ModelPlugin | A plugin with access to physics::Model |
  PluginT | A class which all plugins must inherit from |
  SensorPlugin | A plugin with access to physics::Sensor |
  Server | |
  SystemPlugin | A plugin loaded within the gzserver on startup |
  VisualPlugin | A plugin loaded within the gzserver on startup |
  WorldPlugin | A plugin with access to physics::World |
 google | |
  protobuf | |
   compiler | |
    cpp | |
     GazeboGenerator | Google protobuf message generator for gazebo::msgs |
 Ogre | |
 ogre | |
 SimTK | |
 SkyX | |
 DEM | Encapsulates a DEM (Digital Elevation Model) file |
 Logplay | Open and playback log files that were recorded using LogRecord |
 QuadNode | |
 Road | Used to render a strip of road |
 SensorFactor | The sensor factory; the class is just for namespacing purposes |
 SingletonT | Singleton template class |