CActuatorProperties | Properties for a model of a rotational actuator |
►CAnimation | Manages an animation, which is a collection of keyframes and the ability to interpolate between the keyframes |
CNumericAnimation | A numeric animation |
CPoseAnimation | A pose animation |
►CAtmosphere | This models a base atmosphere class to serve as a common interface to any derived atmosphere models |
CAdiabaticAtmosphere | Adiabatic atmosphere model based on the troposphere model in the Manual of the ICAO Standard Atmosphere |
CAtmosphereFactory | The atmosphere factory instantiates different atmosphere models |
CAudioDecoder | An audio decoder based on FFMPEG |
►CbtGeneric6DofConstraint | |
CgzBtUniversalConstraint | Functions that implement a universal joint/constraint using bullet |
►CbtMotionState | |
CBulletMotionState | Bullet btMotionState encapsulation |
CBuildingMaker | Create and manage 3D visuals of a building |
CBulletMesh | Triangle mesh collision helper class |
CBulletTypes | A set of functions for converting between the math types used by gazebo and bullet |
CBVHLoader | Handles loading BVH animation files |
►CCallbackHelper | A helper class to handle callbacks when messages arrive |
CCallbackHelperT< M > | Callback helper Template |
CRawCallbackHelper | Used to connect publishers to subscribers, where the subscriber wants the raw data from the publisher. Raw means that the data has not been converted into a protobuf message |
CSubscriptionTransport | Handles sending data over the wire to remote subscribers |
CCameraLens | Describes a lens of a camera as amapping function of type r = c1*f*fun(theta/c2+c3) |
►CCodeGenerator | |
CGazeboGenerator | Google protobuf message generator for gazebo::msgs |
CColor | Defines a color |
CConnection | A class that encapsulates a connection |
CConsole | Container for loggers, and global logging options (such as verbose vs. quiet output) |
CContact | A contact between two collisions. Each contact can consist of a number of contact points |
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 |
CConversions | Conversions Conversions.hh rendering/Conversions.hh |
CConversions | Conversions Conversions.hh gui/Conversions.hh |
CDARTMesh | Triangle mesh collision helper class |
CDARTTypes | A set of functions for converting between the math types used by gazebo and dart |
CDEM | Encapsulates a DEM (Digital Elevation Model) file |
CDistortion | Camera distortion based on the Brown-Conrady model |
CEditorMaterialSwitcher | Material switcher for the model editor used to toggle the material of the model |
►Cenable_shared_from_this | |
CBattery | A battery abstraction |
►CVisual | A renderable object |
CApplyWrenchVisual | Visualization for the apply wrench GUI |
CArrowVisual | Basic arrow visualization |
►CAxisVisual | Basic axis visualization |
CLinkFrameVisual | Visualization for link frames |
CCameraVisual | Basic camera visualization |
CCOMVisual | Basic Center of Mass visualization |
CContactVisual | Contact visualization |
CInertiaVisual | Basic Inertia visualization |
CJointVisual | Visualization for joints |
CLaserVisual | Visualization for laser data |
CLogicalCameraVisual | Logical camera visualization |
COriginVisual | Basic world origin visualization |
CRFIDTagVisual | Visualization for RFID tags sensor |
CRFIDVisual | Visualization for RFID sensor |
CRoad2d | |
CSelectionObj | Interactive selection object for models and links |
CSonarVisual | Visualization for sonar data |
CTransmitterVisual | Visualization for the wireless propagation data |
CVideoVisual | A visual element that displays a video as a texture |
CWrenchVisual | Visualization for wrench data. It consists of a purple line pointing at the force direction and 3 RGB cones representing the torque about the XYZ directions |
►CSensor | Base class for sensors |
CAltimeterSensor | AltimeterSensor to provide vertical position and velocity |
►CCameraSensor | Basic camera sensor |
CDepthCameraSensor | |
CWideAngleCameraSensor | Camera sensor with variable mapping function |
CContactSensor | Contact sensor. This sensor detects and reports contacts between objects |
CForceTorqueSensor | Sensor for measure force and torque on a joint |
CGpsSensor | GpsSensor to provide position measurement |
CGpuRaySensor | GPU based laser sensor |
CImuSensor | An IMU sensor |
CLogicalCameraSensor | A camera sensor that reports locations of objects instead of rendering a scene. This camera finds models in the sensor's vicinity, and transmits information about the models on the sensor's topic |
CMagnetometerSensor | MagnetometerSensor to provide magnetic field measurement |
CMultiCameraSensor | Multiple camera sensor. This sensor type can create one or more synchronized cameras |
CRaySensor | Sensor with one or more rays |
CRFIDSensor | Sensor class for RFID type of sensor |
CRFIDTag | RFIDTag to interact with RFIDTagSensors |
CSonarSensor | Sensor with sonar cone |
►CWirelessTransceiver | Sensor class for receiving wireless signals |
CWirelessReceiver | Sensor class for receiving wireless signals |
CWirelessTransmitter | Transmitter to send wireless signals |
►Cenable_shared_from_this | |
►CBase | Base class for most physics classes |
►CEntity | Base class for all physics objects in Gazebo |
►CCollision | Base class for all collision entities |
CBulletCollision | Bullet collisions |
CDARTCollision | Base class for all DART collisions |
CODECollision | Base class for all ODE collisions |
CSimbodyCollision | Simbody collisions |
CLight | A light entity |
►CLink | Link class defines a rigid body entity, containing information on inertia, visual and collision properties of a rigid body |
CBulletLink | Bullet Link class |
CDARTLink | DART Link class |
CODELink | ODE Link class |
CSimbodyLink | Simbody Link class |
►CModel | A model is a collection of links, joints, and plugins |
CActor | Actor class enables GPU based mesh model / skeleton scriptable animation |
CDARTModel | DART model class |
CSimbodyModel | A model is a collection of links, joints, and plugins |
►CJoint | Base class for all joints |
►CBulletJoint | Base class for all joints |
►CBallJoint< BulletJoint > | |
CBulletBallJoint | BulletBallJoint class models a ball joint in Bullet |
►CFixedJoint< BulletJoint > | |
CBulletFixedJoint | A fixed joint |
►CHinge2Joint< BulletJoint > | |
CBulletHinge2Joint | A two axis hinge joint |
►CHingeJoint< BulletJoint > | |
CBulletHingeJoint | A single axis hinge joint |
►CScrewJoint< BulletJoint > | |
CBulletScrewJoint | A screw joint |
►CSliderJoint< BulletJoint > | |
CBulletSliderJoint | A slider joint |
►CUniversalJoint< BulletJoint > | |
CBulletUniversalJoint | A bullet universal joint class |
►CDARTJoint | DART joint interface |
►CBallJoint< DARTJoint > | |
CDARTBallJoint | An DARTBallJoint |
►CFixedJoint< DARTJoint > | |
CDARTFixedJoint | A single axis hinge joint |
►CHinge2Joint< DARTJoint > | |
CDARTHinge2Joint | A two axis hinge joint |
►CHingeJoint< DARTJoint > | |
CDARTHingeJoint | A single axis hinge joint |
►CScrewJoint< DARTJoint > | |
CDARTScrewJoint | A screw joint |
►CSliderJoint< DARTJoint > | |
CDARTSliderJoint | A slider joint |
►CUniversalJoint< DARTJoint > | |
CDARTUniversalJoint | A universal joint |
►CODEJoint | ODE joint interface |
►CBallJoint< ODEJoint > | |
CODEBallJoint | An ODEBallJoint |
►CFixedJoint< ODEJoint > | |
CODEFixedJoint | A fixed joint |
►CGearboxJoint< ODEJoint > | |
CODEGearboxJoint | A double axis gearbox joint |
►CHinge2Joint< ODEJoint > | |
CODEHinge2Joint | A two axis hinge joint |
►CHingeJoint< ODEJoint > | |
CODEHingeJoint | A single axis hinge joint |
►CScrewJoint< ODEJoint > | |
CODEScrewJoint | A screw joint |
►CSliderJoint< ODEJoint > | |
CODESliderJoint | A slider joint |
►CUniversalJoint< ODEJoint > | |
CODEUniversalJoint | A universal joint |
►CSimbodyJoint | Base class for all joints |
►CBallJoint< SimbodyJoint > | |
CSimbodyBallJoint | SimbodyBallJoint class models a ball joint in Simbody |
►CFixedJoint< SimbodyJoint > | |
CSimbodyFixedJoint | A fixed joint rigidly connecting two bodies |
►CHinge2Joint< SimbodyJoint > | |
CSimbodyHinge2Joint | A two axis hinge joint |
►CHingeJoint< SimbodyJoint > | |
CSimbodyHingeJoint | A single axis hinge joint |
►CScrewJoint< SimbodyJoint > | |
CSimbodyScrewJoint | A screw joint |
►CSliderJoint< SimbodyJoint > | |
CSimbodySliderJoint | A slider joint |
►CUniversalJoint< SimbodyJoint > | |
CSimbodyUniversalJoint | A simbody universal joint class |
CRoad | For building a Road from SDF |
►CShape | Base class for all shapes |
►CBoxShape | Box geometry primitive |
CBulletBoxShape | Bullet box collision |
CDARTBoxShape | DART Box shape |
CODEBoxShape | ODE Box shape |
CSimbodyBoxShape | Simbody box collision |
►CCylinderShape | Cylinder collision |
CBulletCylinderShape | Cylinder collision |
CDARTCylinderShape | DART cylinder shape |
CODECylinderShape | ODE cylinder shape |
CSimbodyCylinderShape | Cylinder collision |
►CHeightmapShape | HeightmapShape collision shape builds a heightmap from an image. The supplied image must be square with N*N+1 pixels per side, where N is an integer |
CBulletHeightmapShape | Height map collision |
CDARTHeightmapShape | DART Height map collision |
CODEHeightmapShape | ODE Height map collision |
CSimbodyHeightmapShape | Height map collision |
CMapShape | Creates box extrusions based on an image. This function is not yet complete, to be implemented |
►CMeshShape | Triangle mesh collision shape |
CBulletMeshShape | Triangle mesh collision |
CDARTMeshShape | Triangle mesh collision |
CODEMeshShape | Triangle mesh collision |
CSimbodyMeshShape | Triangle mesh collision |
►CMultiRayShape | Laser collision contains a set of ray-collisions, structured to simulate a laser range scanner |
CBulletMultiRayShape | Bullet specific version of MultiRayShape |
CDARTMultiRayShape | DART specific version of MultiRayShape |
CODEMultiRayShape | ODE specific version of MultiRayShape |
CSimbodyMultiRayShape | Simbody specific version of MultiRayShape |
►CPlaneShape | Collision for an infinite plane |
CBulletPlaneShape | Bullet collision for an infinite plane |
CDARTPlaneShape | An DART Plane shape |
CODEPlaneShape | An ODE Plane shape |
CSimbodyPlaneShape | Simbody collision for an infinite plane |
►CPolylineShape | Polyline geometry primitive |
CBulletPolylineShape | Bullet polyline shape |
CDARTPolylineShape | DART polyline shape |
CODEPolylineShape | ODE polyline shape |
CSimbodyPolylineShape | Simbody polyline shape |
►CRayShape | Base class for Ray collision geometry |
CBulletRayShape | Ray shape for bullet |
CDARTRayShape | Ray collision |
CODERayShape | Ray collision |
CSimbodyRayShape | Ray shape for simbody |
►CSphereShape | Sphere collision shape |
CBulletSphereShape | Bullet sphere collision |
CDARTSphereShape | A DART sphere shape |
CODESphereShape | A ODE sphere shape |
CSimbodySphereShape | Simbody sphere collision |
CWorld | The world provides access to all other object within a simulated environment |
►CCamera | Basic camera sensor |
CDepthCamera | Depth camera used to render depth data into an image buffer |
CGpuLaser | GPU based laser distance sensor |
COculusCamera | A camera used for user visualization of a scene |
CUserCamera | A camera used for user visualization of a scene |
CWideAngleCamera | Camera with variable mapping function |
CLight | A light source |
CScene | Representation of an entire scene graph |
CConnection | Single TCP/IP connection manager |
CNode | A node can advertise and subscribe topics, publish on advertised topics and listen to subscribed topics |
►CEntityMaker | To make an entity, base class |
►CLightMaker | Used to insert a new light into the scene |
CDirectionalLightMaker | Used to insert a new directional light into the scene |
CPointLightMaker | Used to insert a new point light into the scene |
CSpotLightMaker | Used to insert a new spot light into the scene |
CModelMaker | Used to insert new models into the scene |
►CEvent | Base class for all events |
CEventT< bool()> | |
CEventT< void()> | |
CEventT< void(bool)> | |
CEventT< void(bool, bool)> | |
CEventT< void(const gazebo::common::UpdateInfo &)> | |
CEventT< void(const int32_t)> | |
CEventT< void(const msgs::Light &)> | |
CEventT< void(const msgs::Model &)> | |
CEventT< void(const std::string &)> | |
CEventT< void(const std::string &, const ignition::math::Pose3d &, const bool)> | |
CEventT< void(const std::string &, const ignition::math::Vector3d &)> | |
CEventT< void(const unsigned char *, unsigned int, unsigned int, unsigned int, const std::string &)> | |
CEventT< void(double)> | |
CEventT< void(int)> | |
CEventT< void(int, std::string)> | |
CEventT< void(QColor)> | |
CEventT< void(QString)> | |
CEventT< void(sdf::ElementPtr)> | |
CEventT< void(sdf::ElementPtr, const std::string &, const std::string &, const uint32_t)> | |
CEventT< void(sdf::ElementPtr, std::string)> | |
CEventT< void(std::string)> | |
CEventT< void(std::string, bool)> | |
CEventT< void(std::string, ignition::math::Pose3d)> | |
CEventT< void(std::string, std::map< std::string, ignition::math::Vector3d >)> | |
CEventT< void(std::string, std::string)> | |
CEventT< void(std::string, std::string, std::string, bool)> | |
CEventT< void(std::string, std::string, std::string, bool, bool)> | |
CEventT< void(std::string, std::string, std::string, std::string, std::string)> | |
CEventT< T > | A class for event processing |
CEvents | |
CEvents | Base class for rendering events |
CEvents | |
CEvents | An Event class to get notifications for simulator events |
CEvents | |
►CEventSource | The base class for emitting SimEvents |
CExistenceEventSource | |
CInRegionEventSource | The event generator class |
CJointEventSource | The event generator class |
COccupiedEventSource | A plugin that transmits a message when an in-region event occurs |
CSimStateEventSource | SimEvent that fires when the simulation is paused/resumed |
►CException | Class for generating exceptions |
►CInternalError | Class for generating Internal Gazebo Errors: those errors which should never happend and represent programming bugs |
CAssertionInternalError | Class for generating Exceptions which come from gazebo assertions. They include information about the assertion expression violated, function where problem appeared and assertion debug message |
►Cexception | STL class |
►Cruntime_error | STL class |
CSvgError | Handles errors during SVG parsing |
CRestException | |
CSimEventsException | |
►CFlashLightSetting | Internal data class to hold individual flash light settings |
CLedSetting | Internal data class to hold individual LED light settings |
CFrictionPyramid | Parameters used for friction pyramid model |
►CGLSLProgramWriter | |
CCustomGLSLProgramWriter | This overrides ogre's default GLSLProgramWriter to fix a bug in ogre versions <= 1.8 where 'sampler2DShadow' sampler type is missing |
CGpuLaserData | Struct containing info about a single ray measurement |
CGpuLaserDataIterator< F > | Const Bidirectional iterator for laser data |
CGrid | Displays a grid of cells, drawn with lines |
CGripper | A gripper abstraction |
CGTSMeshUtils | Creates GTS utilities for meshes |
Chash< gazebo::Tracks > | |
CHeightmap | Rendering a terrain using heightmap information |
►CHeightmapData | Encapsulates a generic heightmap data file |
CDem | |
CImageHeightmap | Encapsulates an image that will be interpreted as a heightmap |
CHeightmapDataLoader | Helper class for loading heightmap data |
CImage | Encapsulates an image |
CInertial | A class for inertial information about a link |
►CIntegratedPSSM3 | |
CCustomPSSM3 | Custom PSSM shadow receiver that overrides one deficient method in IntegratedPSSM3 |
CIntrospectionClient | Addtogroup gazebo_util |
CIntrospectionCurveHandler | Manages and updates curves based on introspection data |
CIOManager | Manages boost::asio IO |
►Cios_base | STL class |
►Cbasic_ios< Char > | STL class |
►Cbasic_ostream< Char > | STL class |
►Costream | STL class |
CFileLogger | A logger that outputs messages to a file |
CLogger | Terminal logger |
CJointController | A class for manipulating physics::Joint |
CJointWrench | Wrench information from a joint. These are forces and torques on parent and child Links, relative to the Joint frame immediately after rotation |
CKeyEvent | Generic description of a keyboard event |
►CKeyFrame | A key frame in an animation |
CNumericKeyFrame | A keyframe for a NumericAnimation |
CPoseKeyFrame | A keyframe for a PoseAnimation |
CKeyInfo | Store information from SDF for each key |
CLensFlare | Camera lens flare compositor. This lens flare effect does not perform any depth checking so if the directional light is occluded by an object in the scene, lens flare will pass through the object. The lens flare's color is set by the shaders and not exposed through an API in this class |
CLevel | A convenient structure for storing level information |
►CListener | |
CEditorMaterialListener | Ogre material listener |
►CListener | |
CWideAngleCamera | Camera with variable mapping function |
►CLocalResourceRetriever | |
CModelResourceRetriever | |
CLogplay | Open and playback log files that were recorded using LogRecord |
CLogRecordParams | Log recording parameters |
CMaster | A manager that directs topic connections, enables each gazebo network client to locate one another for peer-to-peer communication |
CMaterial | Encapsulates description of a material |
CMaterialDensity | Encapsulates density types |
CMesh | A 3D mesh |
CMeshCSG | Creates CSG meshes |
►CMeshExporter | Base class for exporting meshes |
CColladaExporter | Class used to export Collada mesh files |
►CMeshLoader | Base class for loading meshes |
CColladaLoader | Class used to load Collada mesh files |
COBJLoader | Class used to load obj mesh files |
CSTLLoader | Class used to load STL mesh files |
CMEUserCmd | Class which represents a user command, which can be "undone" and "redone" |
CModelData | |
CMouseEvent | Generic description of a mouse event |
►CMovableObject | |
CMovableText | Movable text |
CMovingWindowFilter< T > | Base class for MovingWindowFilter |
CMsgFactory | A factory that generates protobuf message based on a string type |
CNestedModelData | Helper class to store nested models data |
CNodeAnimation | Node animation |
CNodeAssignment | Vertex to node weighted assignement for skeleton animation visualization |
CNodeTransform | \clas NodeTransform Skeleton.hh common/common.hh |
►CNoise | Noise models for sensor output signals |
►CGaussianNoiseModel | Gaussian noise class |
CImageGaussianNoiseModel | |
CNoiseFactory | Use this noise manager for creating and loading noise models |
CArrangePlugin::Object | Class to store info about each object |
CODEMesh | Triangle mesh helper class |
COpenALSink | OpenAL Listener. This can be thought of as a microphone |
COpenALSource | OpenAL Source. This can be thought of as a speaker |
CParamT< T > | |
►CPhysicsEngine | Base class for a physics engine |
CBulletPhysics | Bullet physics engine |
CDARTPhysics | DART physics engine |
CODEPhysics | ODE physics engine |
CSimbodyPhysics | Simbody physics engine |
CPhysicsFactory | The physics factory instantiates different physics engines |
CPID | Generic PID controller class. Generic proportiolnal-integral-derivative controller class that keeps track of PID-error states and control inputs given the state of a system and a user specified target state |
CPlotCurve | Plot Curve data |
CPluginT< T > | A class which all plugins must inherit from |
►CPluginT< GUIPlugin > | |
►CGUIPlugin | A plugin loaded within the gzclient on startup |
CCessnaGUIPlugin | A GUI plugin that controls the Cessna model using the keyboard |
CKeyboardGUIPlugin | A GUI plugin that captures key strokes from gzclient GUI and publishes over gz transport topic ~/keyboard/keypress |
CLookAtDemoPlugin | A GUI plugin that demos the ignition::math::Matrix4<T>::LookAt function |
CTimerGUIPlugin | A GUI plugin that displays a timer |
►CPluginT< ModelPlugin > | |
►CModelPlugin | A plugin with access to physics::Model |
CActorPlugin | |
CActuatorPlugin | Plugin for simulating a torque-speed curve for actuators |
CArduCopterPlugin | Interface ArduCopter from ardupilot stack modeled after SITL/SIM_* |
CAttachLightPlugin | A model plugin that enables multiple lights in the world to be attached to links within the model |
CBuoyancyPlugin | A plugin that simulates buoyancy of an object immersed in fluid |
CCartDemoPlugin | This plugin drives a four wheeled cart model forward and back by applying a small wheel torque |
CCessnaPlugin | Allow moving the control surfaces of a Cessna C-172 plane |
CDiffDrivePlugin | |
CElevatorPlugin | Plugin to control a elevator |
►CFlashLightPlugin | A plugin that blinks a light component in the model |
CLedPlugin | A plugin that blinks light and visual elements in a model |
CFollowerPlugin | A simple object follower that finds the closest object in a depth image and commands a differential drive vehicle to move towards the object |
CGimbalSmall2dPlugin | A plugin for controlling the angle of a gimbal joint |
CGravityCompensationPlugin | Plugin that provides gravity compensation |
CHarnessPlugin | This plugin is designed to lower a model at a controlled rate |
CHydraDemoPlugin | |
CInitialVelocityPlugin | |
CJointControlPlugin | Plugin that initializes joint controllers |
CJointTrajectoryPlugin | |
CKeysToCmdVelPlugin | Send velocity commands to a model based on keypress messages received |
CKeysToJointsPlugin | Control joints in a model based on keypress messages received |
CLiftDragPlugin | A plugin that simulates lift and drag |
CLinearBatteryConsumerPlugin | A plugin that manages a linear battery consumer |
CLinearBatteryPlugin | A plugin that simulates a linear battery |
CLinkPlot3DPlugin | A plugin that traces the trajectory of a link in the rendering scene |
CMudPlugin | |
CPlaneDemoPlugin | A plugin that simulates lift and drag |
CRandomVelocityPlugin | Plugin that applies a random velocity to a linke periodically |
CRegionEventBoxPlugin | A plugin that fires an event when another model enters the region defined by the size of this model's box visual |
CSkidSteerDrivePlugin | A gazebo model plugin that controls a four wheel skid-steer robot via a gazebo topic |
CSphereAtlasDemoPlugin | |
CTouchPlugin | Plugin which checks if this model has touched some specific target for a given time continuously and exclusively |
►CTrackedVehiclePlugin | An abstract gazebo model plugin for tracked vehicles |
CSimpleTrackedVehiclePlugin | A very fast, but also very accurate model of non-deformable tracks without grousers |
CWheelTrackedVehiclePlugin | An approximate model of non-deformable tracks emulated by wheels |
CVariableGearboxPlugin | A plugin that uses piecewise cubic Hermite splines to support arbitrary smooth input-output relationships between the input and output angles of a gearbox |
CVehiclePlugin | |
CWheelSlipPlugin | A plugin that updates ODE wheel slip parameters based on linear wheel spin velocity (radius * spin rate) |
►CPluginT< SensorPlugin > | |
►CSensorPlugin | A plugin with access to physics::Sensor. See reference |
CBreakableJointPlugin | A plugin for breakable joints, based on a ForceTorque sensor plugin |
CCameraPlugin | |
CContactPlugin | A plugin for a contact sensor |
CDepthCameraPlugin | |
CFiducialCameraPlugin | A camera sensor plugin for fiducial detection A fiducial is detected if its center is within the camera frustum and not occluded by other models in the view |
CForceTorquePlugin | An base class plugin for custom force torque sensor processing |
CGpuRayPlugin | |
CImuSensorPlugin | An base class plugin for custom imu sensor processing |
CLensFlareSensorPlugin | Plugin that adds lens flare effect to a camera or multicamera sensor The plugin has the following optional parameter: <scale> Scale of lens flare |
CPressurePlugin | A plugin for a tactile pressure sensor |
CRayPlugin | A Ray Sensor Plugin |
CRaySensorNoisePlugin | A Ray Sensor Noise Plugin |
CSonarPlugin | A sonar sensor plugin |
►CPluginT< SystemPlugin > | |
►CSystemPlugin | A plugin loaded within the gzserver on startup |
CModelPropShop | This plugin will generate 5 pictures of a model: perspective, top, front, side, back |
CRestUiPlugin | REST user interface plugin |
CRestWebPlugin | REST web plugin |
►CPluginT< VisualPlugin > | |
►CVisualPlugin | A plugin with access to rendering::Visual |
CAmbientOcclusionVisualPlugin | Plugin that creates an ambient occlusion effect The current implementation uses the Crease Shading method ported from OGRE |
CBlinkVisualPlugin | Plugin that makes a visual blink between two colors |
CHeightmapLODPlugin | Plugin that sets the heightmap LOD |
CShaderParamVisualPlugin | A plugin that demonstrates how to set shader parameters of a material used by a visual |
►CPluginT< WorldPlugin > | |
►CWorldPlugin | A plugin with access to physics::World. See reference |
CArrangePlugin | |
CContainPlugin | Plugin which emits Ignition Transport messages according to whether an entity's origin is inside or outside a given volume |
CJoyPlugin | The JoyPlugin connects to a joystick or gamepad, and transmits data from the joystick over an Ignition Transport topic |
CMisalignmentPlugin | Plugin which emits gazebo transport message indicating the alignment of two poses |
CRazerHydra | |
CRubblePlugin | |
CSimEventsPlugin | |
CStaticMapPlugin | A plugin that creates a model with textured map images |
CTransporterPlugin | A plugin that allows models to transport (teleport) to a new location |
CWindPlugin | A plugin that simulates a simple wind model |
CPopulation | Class that automatically populates an environment with multiple objects based on several parameters to define the number of objects, shape of the object distribution or type of distribution |
CPopulationParams | Stores all the posible parameters that define a population |
CPreset | Representation of a preset physics profile |
CPresetManager | Class to manage preset physics profiles |
►CProgramWriterFactory | |
CCustomGLSLProgramWriterFactory | A factory to create our own CustomGLSLProgramWriter |
CProjector | Projects a material onto surface, light a light projector |
►CPSSMShadowCameraSetup | |
CCustomPSSMShadowCameraSetup | Parallel Split Shadow Map (PSSM) shadow camera setup |
CPublication | A publication for a topic. This facilitates transport of messages |
CPublicationTransport | Reads data from a remote advertiser, and passes the data along to local subscribers |
CPublisher | A publisher of messages on a topic |
►CQAction | |
CDeleteAction | Custom delete action |
►CQDialog | |
CApplyWrenchDialog | Dialog for applying force and torque to a model |
►CBaseInspectorDialog | Base Dialog for a specific inspector dialog |
CLevelInspectorDialog | Dialog for configuring a building level |
CStairsInspectorDialog | Dialog for configuring a staircase item |
CWallInspectorDialog | Dialog for configuring a wall item |
CWindowDoorInspectorDialog | Dialog for configuring a window or door item |
CCloneWindow | A dialog window used to set some parameters before cloning a simulation |
CDataLogger | A widget that provides data logging functionality |
CExportDialog | Dialog for saving to file |
CExtrudeDialog | Dialog for saving to file |
CImportDialog | Dialog for saving to file |
CImportImageDialog | |
CJointCreationDialog | A class to inspect and modify joints |
CJointInspector | A class to inspect and modify joints |
CLinkInspector | |
CModelPluginInspector | Inspector for model plugin properties |
CRestUiLoginDialog | Provides a means to login to a webservice |
CSaveEntityDialog | Dialog for saving to file |
CTopicSelector | A widget that provides a list of topics to select from |
►CTopicView | Base class for widgets that display topic data |
CImagesView | |
CImageView | |
CLaserView | |
CTextView | |
►CQFrame | |
►CConfigChildWidget | A convenience widget that also holds pointers to a list of its child widgets |
CDensityConfigWidget | A widget for configuring density properties |
CEnumConfigWidget | A widget for configuring enum values |
CGeometryConfigWidget | A widget for configuring geometry properties |
CImageFrame | Frame that draws an image when a paintevent is received |
CTopToolbar | Toolbar on the top of the main window |
►CQGraphicsItem | |
CGrabberHandle | |
CGridLines | 2D grid lines |
CRotateHandle | Handle for rotating an editor item |
►CQGraphicsLineItem | |
►CSegmentItem | 2D line segment |
CMeasureItem | Measurement lines and values |
CWallSegmentItem | 2D representation of a wall |
►CQGraphicsRectItem | |
CCurrentTimeItem | Item which represents the current time within the view |
►CRectItem | 2D rectangle |
CDoorItem | 2D representation of a door |
CFloorItem | 2D representation of a floor |
CStairsItem | 2D representation of a staircase |
CWindowItem | 2D representation of a window |
►CQGraphicsView | |
CEditorView | Control the editor view and manage contents in the editor scene |
CGraphView | A view for the graph scene |
CImportImageView | Control the import image view and manage contents in the scene |
CLogPlayView | View for the timeline |
►CQGVScene | |
CGraphScene | A scene of 2D graph nodes and edges |
►CQMainWindow | |
CMainWindow | |
►CQObject | |
CBuildingModelManip | Manipulate a 3D visual associated to a 2D editor item |
CCurrentTimeItem | Item which represents the current time within the view |
►CEditor | Base class for editors, such as BuildingEditor and TerrainEditor |
CBuildingEditor | |
CModelEditor | Interface to the terrain editor |
CTerrainEditor | Interface to the terrain editor |
►CEditorItem | Base class of an item in the editor |
CRectItem | 2D rectangle |
CSegmentItem | 2D line segment |
CJointData | Helper class to store joint data |
CJointMaker | Handles the creation of joints in the model editor |
CLinkData | Helper class to store link data |
CModelCreator | Create and manage 3D visuals of a model with links, nested models and joints |
CModelPluginData | Helper class to store model plugin data |
CModelRightMenu | Displays a menu when the right mouse button has been pressed |
CSplashScreen | Splash screen that displays an icon and a message |
►CUserCmdHistory | Class which manages user commands in the client side |
CMEUserCmdManager | Class which manages user commands in the model editor |
CViewState | A class for managing view visualization states. Used by ModelRightMenu |
CQTestFixture | Base class for all Gazebo GUI unit tests |
►CQSortFilterProxyModel | |
CSearchModel | Customize the proxy model to display search results |
CQuadNode | |
►CQWidget | |
CAlignWidget | A gui widget for aligning models |
CBuildingEditorPalette | A palette of building items which can be added to the editor |
CBuildingEditorWidget | The parent widget of the building editor, level widget and scale widget |
CCollisionConfig | A tab for configuring collision properties of a link |
CCollisionConfigData | A class of widgets used for configuring collision properties |
CConfigWidget | A widget generated from a google protobuf message |
CEditableLabel | Editable Label |
CGLWidget | |
CGroupWidget | A collapsible widget that holds child widgets |
CInsertModelWidget | |
CJointControlWidget | Widget to control joints via application of force, position PID controller, or velocity PID controller |
CJointForceControl | Widget to control joints via application of force |
CJointPIDPosControl | Widget to control joints via application of position PID controller |
CJointPIDVelControl | Widget to control joints via application of a velocity PID controller |
CLayersWidget | A widget that manages visualization layers |
CLevelWidget | A widget for adding and changing building levels |
CLinkConfig | A tab for configuring properties of a link |
CLogPlayWidget | Widget which displays log playback options |
CModelEditorPalette | A palette of model items which can be added to the editor |
CModelListWidget | |
CModelTreeWidget | A widget that displays model properties |
COculusWindow | A widget that renders a camera view suitable for the Oculus Rift |
CPalette | A palette for the plot window, where plottable items can be dragged from |
CPlotCanvas | Plot canvas |
CPlotWindow | Plot window |
CRenderWidget | |
CScaleWidget | Widget that displays the scale (zoom level) of the editor |
CSchematicViewWidget | The parent widget of the CML editor |
CTerrainEditorPalette | A palette of building items which can be added to the editor |
CTimePanel | |
CTimeWidget | |
CToolsWidget | A widget that manages all the tools on the right side of the render widget |
CVariablePill | A variable pill |
CVariablePillContainer | A container for holding variable pills |
CVideoRecorder | Helper class for recording the user camera to a video file |
CViewAngleWidget | A gui widget for changing the camera view angle |
CVisualConfig | A tab for configuring visual properties of a link |
CVisualConfigData | A class of widgets used for configuring visual properties |
CGUIPlugin | A plugin loaded within the gzclient on startup |
CRestUiWidget | REST user interface widget |
►CQwtPlot | |
CIncrementalPlot | A plotting widget that handles incremental addition of data |
►CQwtPlotPicker | |
CPlotTracker | Mouse hover tracking |
CRayQuery | A Ray Query class used for retrieving mesh data of a visual, adapted from Ogre3D wiki |
CRegion | A region, made of a list of boxes |
►CRenderable | |
CMovableText | Movable text |
►CRenderObjectListener | |
CGpuLaser | GPU based laser distance sensor |
►CRenderTargetListener | |
CEditorRenderTargetListener | Ogre render target listener |
CRestApi | REST interface |
CRoad | Used to render a strip of road |
CSemanticVersion | Version comparison class based on Semantic Versioning 2.0.0 http://semver.org/ Compares versions and converts versions from string |
CSensorFactor | The sensor factory; the class is just for namespacing purposes |
CSensorFactory | |
CServer | |
CSimbodyMesh | Triangle mesh collision helper class |
CSimEventConnector | Gazebo events to detect model creation/deletion |
►CSimpleRenderable | |
►CDynamicRenderable | Abstract base class providing mechanisms for dynamically growing hardware buffers |
CDynamicLines | Class for drawing lines that can change |
CSingletonT< T > | Singleton template class |
►CSingletonT< ConnectionManager > | |
CConnectionManager | Manager of connections |
►CSingletonT< DiagnosticManager > | |
CDiagnosticManager | A diagnostic manager class |
►CSingletonT< FuelModelDatabase > | |
CFuelModelDatabase | Connects to an Igniiton Fuel model database, and has utility functions to find models |
►CSingletonT< IntrospectionManager > | |
CIntrospectionManager | Addtogroup gazebo_util |
►CSingletonT< LogPlay > | |
CLogPlay | |
►CSingletonT< LogRecord > | |
CLogRecord | Addtogroup gazebo_util |
►CSingletonT< MeshManager > | |
CMeshManager | Maintains and manages all meshes |
►CSingletonT< ModelAlign > | |
CModelAlign | A gui tool for aligning models |
►CSingletonT< ModelDatabase > | |
CModelDatabase | Connects to model database, and has utility functions to find models |
►CSingletonT< ModelManipulator > | |
CModelManipulator | Manipulator tool for translating/rotating/scaling models and links |
►CSingletonT< ModelSnap > | |
CModelSnap | A gui tool for snapping one model to another |
►CSingletonT< OpenAL > | |
COpenAL | 3D audio setup and playback |
►CSingletonT< PlotManager > | |
CPlotManager | A class that connects simulation data with the plotting tool |
►CSingletonT< RenderEngine > | |
CRenderEngine | Adaptor to Ogre3d |
►CSingletonT< RTShaderSystem > | |
CRTShaderSystem | Implements Ogre's Run-Time Shader system |
►CSingletonT< SensorManager > | |
CSensorManager | Class to manage and update all sensors |
►CSingletonT< SystemPaths > | |
CSystemPaths | Functions to handle getting system paths, keeps track of: |
►CSingletonT< TopicManager > | |
CTopicManager | Manages topics and their subscriptions |
CSkeleton | A skeleton |
CSkeletonAnimation | Skeleton animation |
CSkeletonNode | A skeleton node |
CSpaceNav | Interface to the space navigator joystick |
CSphericalCoordinates | Convert spherical coordinates for planetary surfaces |
►CState | State of an entity |
CCollisionState | Store state information of a physics::Collision object |
CJointState | Keeps track of state of a physics::Joint |
CLightState | Store state information of a Light object |
CLinkState | Store state information of a physics::Link object |
CModelState | Store state information of a physics::Model object |
CWorldState | Store state information of a physics::World object |
►Cstringbuf | |
CFileLogger::Buffer | String buffer for the file logger |
CLogger::Buffer | String buffer for the base logger |
CSubMesh | A child mesh |
►CSubRenderStateFactory | |
CCustomPSSM3Factory | A factory that enables creation of CustomPSSM3 instances |
CSubscribeOptions | Options for a subscription |
CSubscriber | A subscriber to a topic |
►CSurfaceParams | SurfaceParams defines various Surface contact parameters. These parameters defines the properties of a physics::Contact constraint |
CBulletSurfaceParams | Bullet surface parameters |
CDARTSurfaceParams | DART surface parameters |
CODESurfaceParams | ODE surface parameters |
CSVGCommand | SVG command data structure |
CSVGLoader | A loader for SVG files |
CSVGPath | An SVG path element data structure |
►CTest | |
►CServerFixture | |
CRenderingFixture | |
CTime | A Time class, can be used to hold wall- or sim-time. stored as sec and nano-sec |
►CTimer | A timer class, used to time things in real world walltime |
CDiagnosticTimer | A timer designed for diagnostics |
CTopicCurveHandler | Manages and updates curves based on topic data |
CTrajectoryInfo | Information about a trajectory for an Actor |
CUpdateInfo | Information for use in an update event |
CURI | A complete URI |
CURIPath | The path component of a URI |
CURIQuery | The query component of a URI |
CUserCmd | Class which represents a user command, which can be "undone" and "redone" |
CUserCmdManager | Manages user commands from the server side |
CVideo | Handle video encoding and decoding using libavcodec |
CVideoEncoder | Supports encoding a series of images to a video format, and then writing the video to disk |
►CViewController | Base class for view controllers |
CFPSViewController | First Person Shooter style view controller |
►COrbitViewController | Orbit view controller |
COrthoViewController | Orthographic view controller |
CViewFactory | The view factory creates GUI widgets to visualize data on a topic |
CVolumeProperties | A class for storing the volume properties of a link |
CWheelTrackedVehiclePlugin::WheelInfo | Holds information about each wheel |
CWind | Base class for wind |
CWindowManager | Class to mangage render windows |
CWireBox | Draws a wireframe box |
►CT | |
CBallJoint< T > | Base class for a ball joint |
CFixedJoint< T > | A fixed joint rigidly connecting two bodies |
CGearboxJoint< T > | A double axis gearbox joint |
CHinge2Joint< T > | A two axis hinge joint |
CHingeJoint< T > | A single axis hinge joint |
CScrewJoint< T > | A screw joint, which has both prismatic and rotational DOFs |
CSliderJoint< T > | A slider joint |
CUniversalJoint< T > | A universal joint. Axis1 and axis2 are body-fixed, with axis1 attached to parent body and axis2 attached to child body |