▼Ngazebo | Forward declarations for the common classes |
►Ncommon | Common namespace |
CAnimation | Manages an animation, which is a collection of keyframes and the ability to interpolate between the keyframes |
CAssertionInternalError | Class for generating Exceptions which come from gazebo assertions |
CAudioDecoder | An audio decoder based on FFMPEG |
CBVHLoader | Handles loading BVH animation files |
CColladaLoader | Class used to load Collada mesh files |
CColor | Defines a color |
CConsole | Container for loggers, and global logging options (such as verbose vs |
CDem | |
CDemPrivate | Private data for the Dem class |
CException | Class for generating exceptions |
►CFileLogger | A logger that outputs messages to a file |
CBuffer | String buffer for the file logger |
CHeightmapData | Encapsulates a generic heightmap data file |
CImage | Encapsulates an image |
CImageHeightmap | Encapsulates an image that will be interpreted as a heightmap |
CInternalError | Class for generating Internal Gazebo Errors: those errors which should never happend and represent programming bugs |
CKeyEvent | Generic description of a keyboard event |
CKeyFrame | A key frame in an animation |
►CLogger | Terminal logger |
CBuffer | String buffer for the base logger |
CMaterial | Encapsulates description of a material |
CMesh | A 3D mesh |
CMeshCSG | Creates CSG meshes |
CMeshLoader | Base class for loading meshes |
CMeshManager | Maintains and manages all meshes |
CModelDatabase | Connects to model database, and has utility functions to find models |
CModelDatabasePrivate | Private class attributes for ModelDatabase |
CMouseEvent | Generic description of a mouse event |
CMovingWindowFilter | Base class for MovingWindowFilter |
CMovingWindowFilterPrivate | |
CNodeAnimation | Node animation |
CNodeAssignment | Vertex to node weighted assignement for skeleton animation visualization |
CNodeTransform | NodeTransform Skeleton.hh common/common.hh |
CNumericAnimation | A numeric animation |
CNumericKeyFrame | A keyframe for a NumericAnimation |
CParamT | |
CPID | Generic PID controller class |
CPoseAnimation | A pose animation |
CPoseKeyFrame | A keyframe for a PoseAnimation |
CSkeleton | A skeleton |
CSkeletonAnimation | Skeleton animation |
CSkeletonNode | A skeleton node |
CSphericalCoordinates | Convert spherical coordinates for planetary surfaces |
CSphericalCoordinatesPrivate | Commmon/common.hh |
CSTLLoader | Class used to load STL mesh files |
CSubMesh | A child mesh |
CSystemPaths | Functions to handle getting system paths, keeps track of: |
CTime | A Time class, can be used to hold wall- or sim-time |
CTimer | A timer class, used to time things in real world walltime |
CUpdateInfo | Information for use in an update event |
CVideo | Handle video encoding and decoding using libavcodec |
►Nevent | Event namespace |
CConnection | A class that encapsulates a connection |
CConnectionPrivate | |
CEvent | Base class for all events |
CEventPrivate | |
CEvents | An Event class to get notifications for simulator events |
CEventT | A class for event processing |
CEventTPrivate | |
►Nmath | Math namespace |
CAngle | An angle and related functions |
CBox | Mathematical representation of a box and related functions |
CMatrix3 | A 3x3 matrix class |
CMatrix4 | A 3x3 matrix class |
CPlane | A plane and related functions |
CPose | Encapsulates a position and rotation in three space |
CQuaternion | A quaternion class |
CRand | Random number generator class |
CRotationSpline | Spline for rotations |
CSpline | Splines |
CVector2d | Generic double x, y vector |
CVector2i | Generic integer x, y vector |
CVector3 | Generic vector containing 3 elements |
CVector4 | Double Generic x, y, z, w vector |
►Nmsgs | Messages namespace |
CMsgFactory | A factory that generates protobuf message based on a string type |
►Nphysics | Namespace for physics |
CActor | Actor class enables GPU based mesh model / skeleton scriptable animation |
CBallJoint | Base class for a ball joint |
CBase | Base class for most physics classes |
CBoxShape | Box geometry primitive |
CCollision | Base class for all collision entities |
CCollisionState | Store state information of a physics::Collision object |
CContact | A contact between two collisions |
CContactManager | Aggregates all the contact information generated by the collision detection engine |
CContactPublisher | A custom contact publisher created for each contact filter in the Contact Manager |
CCylinderShape | Cylinder collision |
CDARTBallJoint | An DARTBallJoint |
CDARTBoxShape | DART Box shape |
CDARTCollision | Base class for all DART collisions |
CDARTCylinderShape | DART cylinder shape |
CDARTHeightmapShape | DART Height map collision |
CDARTHinge2Joint | A two axis hinge joint |
CDARTHingeJoint | A single axis hinge joint |
CDARTJoint | DART joint interface |
CDARTLink | DART Link class |
CDARTMeshShape | Triangle mesh collision |
CDARTModel | DART model class |
CDARTMultiRayShape | DART specific version of MultiRayShape |
CDARTPhysics | DART physics engine |
CDARTPlaneShape | An DART Plane shape |
CDARTRayShape | Ray collision |
CDARTScrewJoint | A screw joint |
CDARTSliderJoint | A slider joint |
CDARTSphereShape | A DART sphere shape |
CDARTTypes | A set of functions for converting between the math types used by gazebo and dart |
CDARTUniversalJoint | A universal joint |
CEntity | Base class for all physics objects in Gazebo |
CFrictionPyramid | Parameters used for friction pyramid model |
CGearboxJoint | A double axis gearbox joint |
CGripper | A gripper abstraction |
CHeightmapShape | HeightmapShape collision shape builds a heightmap from an image |
CHinge2Joint | A two axis hinge joint |
CHingeJoint | A single axis hinge joint |
CInertial | A class for inertial information about a link |
CJoint | Base class for all joints |
CJointController | A class for manipulating physics::Joint |
CJointControllerPrivate | |
CJointState | Keeps track of state of a physics::Joint |
CJointWrench | Wrench information from a joint |
CLink | Link class defines a rigid body entity, containing information on inertia, visual and collision properties of a rigid body |
CLinkState | Store state information of a physics::Link object |
CMapShape | Creates box extrusions based on an image |
CMeshShape | Triangle mesh collision shape |
CModel | A model is a collection of links, joints, and plugins |
CModelState | Store state information of a physics::Model object |
CMultiRayShape | Laser collision contains a set of ray-collisions, structured to simulate a laser range scanner |
CPhysicsEngine | Base class for a physics engine |
CPhysicsFactory | The physics factory instantiates different physics engines |
CPlaneShape | Collision for an infinite plane |
CRayShape | Base class for Ray collision geometry |
CRoad | For building a Road from SDF |
CScrewJoint | A screw joint, which has both prismatic and rotational DOFs |
CShape | Base class for all shapes |
CSimbodyBallJoint | SimbodyBallJoint class models a ball joint in Simbody |
CSimbodyBoxShape | Simbody box collision |
CSimbodyCollision | Simbody collisions |
CSimbodyCylinderShape | Cylinder collision |
CSimbodyHeightmapShape | Height map collision |
CSimbodyHinge2Joint | A two axis hinge joint |
CSimbodyHingeJoint | A single axis hinge joint |
CSimbodyJoint | Base class for all joints |
CSimbodyLink | Simbody Link class |
CSimbodyMeshShape | Triangle mesh collision |
CSimbodyModel | A model is a collection of links, joints, and plugins |
CSimbodyMultiRayShape | Simbody specific version of MultiRayShape |
CSimbodyPhysics | Simbody physics engine |
CSimbodyPlaneShape | Simbody collision for an infinite plane |
CSimbodyRayShape | Ray shape for simbody |
CSimbodyScrewJoint | A screw joint |
CSimbodySliderJoint | A slider joint |
CSimbodySphereShape | Simbody sphere collision |
CSimbodyUniversalJoint | A simbody universal joint class |
CSliderJoint | A slider joint |
CSphereShape | Sphere collision shape |
CState | State of an entity |
CSurfaceParams | SurfaceParams defines various Surface contact parameters |
CTrajectoryInfo | Information about a trajectory for an Actor |
CUniversalJoint | A universal joint |
CWorld | The world provides access to all other object within a simulated environment |
CWorldState | Store state information of a physics::World object |
►Nrendering | Rendering namespace |
CArrowVisual | Basic arrow visualization |
CArrowVisualPrivate | Private data for the Arrow Visual class |
CAxisVisual | Basic axis visualization |
CAxisVisualPrivate | Private data for the Axis Visual class |
CCamera | Basic camera sensor |
CCameraPrivate | Private data for the Camera class |
CCameraVisual | Basic camera visualization |
CCameraVisualPrivate | |
CCOMVisual | Basic Center of Mass visualization |
CCOMVisualPrivate | Private data for the COM Visual class |
CContactVisual | Contact visualization |
►CContactVisualPrivate | Private data for the Arrow Visual class |
CContactPoint | A contact point visualization |
CConversions | Conversions Conversions.hh rendering/Conversions.hh |
CDepthCamera | Depth camera used to render depth data into an image buffer |
CDummyPageProvider | Pretends to provide procedural page content to avoid page loading |
CDynamicLines | Class for drawing lines that can change |
CDynamicRenderable | Abstract base class providing mechanisms for dynamically growing hardware buffers |
CEvents | Base class for rendering events |
CFPSViewController | First Person Shooter style view controller |
CGpuLaser | GPU based laser distance sensor |
CGrid | Displays a grid of cells, drawn with lines |
CGUIOverlay | A class that creates a CEGUI overlay on a render window |
CGUIOverlayPrivate | Private data for the GUIOverlay class |
►CGzTerrainMatGen | |
►CSM2Profile | Shader model 2 profile target |
CShaderHelperCg | Keeping the CG shader for reference |
CShaderHelperGLSL | Utility class to help with generating shaders for GLSL |
CHeightmap | Rendering a terrain using heightmap information |
CJointVisual | Visualization for joints |
CJointVisualPrivate | Private data for the Joint Visual class |
CLaserVisual | Visualization for laser data |
CLaserVisualPrivate | Private data for the Laser Visual class |
CLight | A light source |
CMovableText | Movable text |
COrbitViewController | Orbit view controller |
CProjector | Projects a material onto surface, light a light projector |
CRenderEngine | Adaptor to Ogre3d |
CRFIDTagVisual | Visualization for RFID tags sensor |
CRFIDTagVisualPrivate | Private data for the RFID Tag Visual class |
CRFIDVisual | Visualization for RFID sensor |
CRFIDVisualPrivate | Private data for the RFID Visual class |
CRoad2d | |
CRTShaderSystem | Implements Ogre's Run-Time Shader system |
CScene | Representation of an entire scene graph |
CSelectionObj | Interactive selection object for models and links |
CSelectionObjPrivate | Private data for the Selection Obj class |
CSonarVisual | Visualization for sonar data |
CSonarVisualPrivate | Private data for the Sonar Visual class |
CTransmitterVisual | Visualization for the wireless propagation data |
CTransmitterVisualPrivate | Private data for the Transmitter Visual class |
CUserCamera | A camera used for user visualization of a scene |
CUserCameraPrivate | Private data for the UserCamera class |
CVideoVisual | A visual element that displays a video as a texture |
CVideoVisualPrivate | Private data for the Video Visual class |
CViewController | Base class for view controllers |
CVisual | A renderable object |
CVisualPrivate | Private data for the Visual class |
CWindowManager | Class to mangage render windows |
CWireBox | Draws a wireframe box |
CWireBoxPrivate | Private data for the WireBox class |
CWrenchVisual | Visualization for sonar data |
CWrenchVisualPrivate | Private data for the Wrench Visual class |
►Nsensors | Sensors namespace |
CCameraSensor | Basic camera sensor |
CContactSensor | Contact sensor |
CDepthCameraSensor | |
CForceTorqueSensor | Sensor for measure force and torque on a joint |
CGaussianNoiseModel | Gaussian noise class |
CGpsSensor | GpsSensor to provide position measurement |
CGpuRaySensor | |
CImageGaussianNoiseModel | |
CImuSensor | An IMU sensor |
CMultiCameraSensor | Multiple camera sensor |
CNoise | Noise models for sensor output signals |
CNoiseFactory | Use this noise manager for creating and loading noise models |
CRaySensor | Sensor with one or more rays |
CRFIDSensor | Sensor class for RFID type of sensor |
CRFIDTag | RFIDTag to interact with RFIDTagSensors |
CSensor | Base class for sensors |
CSensorFactory | |
CSensorManager | Class to manage and update all sensors |
CSonarSensor | Sensor with sonar cone |
CWirelessReceiver | Sensor class for receiving wireless signals |
CWirelessTransceiver | Sensor class for receiving wireless signals |
CWirelessTransmitter | Transmitter to send wireless signals |
►Ntransport | |
CCallbackHelper | A helper class to handle callbacks when messages arrive |
CCallbackHelperT | Callback helper Template |
CConnection | Single TCP/IP connection manager |
CConnectionManager | Manager of connections |
CIOManager | Manages boost::asio IO |
CNode | A node can advertise and subscribe topics, publish on advertised topics and listen to subscribed topics |
CPublication | A publication for a topic |
CPublicationTransport | Transport/transport.hh |
CPublisher | A publisher of messages on a topic |
CRawCallbackHelper | Used to connect publishers to subscribers, where the subscriber wants the raw data from the publisher |
CSubscribeOptions | Options for a subscription |
CSubscriber | A subscriber to a topic |
CSubscriptionTransport | Transport/transport.hh |
CTopicManager | Manages topics and their subscriptions |
►Nutil | |
CDiagnosticManager | A diagnostic manager class |
CDiagnosticTimer | A timer designed for diagnostics |
CLogPlay | |
CLogRecord | Addtogroup gazebo_util |
COpenAL | 3D audio setup and playback |
COpenALSink | OpenAL Listener |
COpenALSource | OpenAL Source |
CMaster | A manager that directs topic connections, enables each gazebo network client to locate one another for peer-to-peer communication |
CModelPlugin | A plugin with access to physics::Model |
CPluginT | A class which all plugins must inherit from |
CSensorPlugin | A plugin with access to physics::Sensor |
CServer | |
CSystemPlugin | A plugin loaded within the gzserver on startup |
CVisualPlugin | A plugin loaded within the gzserver on startup |
CWorldPlugin | A plugin with access to physics::World |
▼Ngoogle | |
►Nprotobuf | |
►Ncompiler | |
►Ncpp | |
CGazeboGenerator | Google protobuf message generator for gazebo::msgs |
CDEM | Encapsulates a DEM (Digital Elevation Model) file |
CLogplay | Open and playback log files that were recorded using LogRecord |
CQuadNode | |
CRoad | Used to render a strip of road |
CSensorFactor | The sensor factory; the class is just for namespacing purposes |
CSingletonT | Singleton template class |