boost | |
filesystem | |
gazebo | Forward declarations for the common classes |
client | |
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 |
Battery | A battery abstraction |
BVHLoader | Handles loading BVH animation files |
ColladaExporter | Class used to export Collada mesh 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 | |
Exception | Class for generating exceptions |
FileLogger | A logger that outputs messages to a file |
Buffer | String buffer for the file logger |
FuelModelDatabase | Connects to an Igniiton Fuel model database, and has utility functions to find models |
GTSMeshUtils | Creates GTS utilities for meshes |
HeightmapData | Encapsulates a generic heightmap data file |
HeightmapDataLoader | Helper class for loading heightmap data |
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 |
MaterialDensity | Encapsulates density types |
Mesh | A 3D mesh |
MeshCSG | Creates CSG meshes |
MeshExporter | Base class for exporting 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 |
MouseEvent | Generic description of a mouse event |
MovingWindowFilter | Base class for MovingWindowFilter |
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 |
OBJLoader | Class used to load obj mesh files |
ParamT | |
PID | Generic PID controller class |
PoseAnimation | A pose animation |
PoseKeyFrame | A keyframe for a PoseAnimation |
SemanticVersion | Version comparison class based on Semantic Versioning 2.0.0 http://semver.org/ Compares versions and converts versions from string |
Skeleton | A skeleton |
SkeletonAnimation | Skeleton animation |
SkeletonNode | A skeleton node |
SphericalCoordinates | Convert spherical coordinates for planetary surfaces |
STLLoader | Class used to load STL mesh files |
SubMesh | A child mesh |
SVGCommand | SVG command data structure |
SvgError | Handles errors during SVG parsing |
SVGLoader | A loader for SVG files |
SVGPath | An SVG path element data structure |
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 |
URI | A complete URI |
URIPath | The path component of a URI |
URIQuery | The query component of a URI |
Video | Handle video encoding and decoding using libavcodec |
VideoEncoder | Supports encoding a series of images to a video format, and then writing the video to disk |
event | Event namespace |
Connection | A class that encapsulates a connection |
Event | Base class for all events |
Events | An Event class to get notifications for simulator events |
EventT | A class for event processing |
gui | Gui namespace |
editor | |
Events | |
model | |
Events | |
AlignWidget | A gui widget for aligning models |
ApplyWrenchDialog | Dialog for applying force and torque to a model |
BaseInspectorDialog | Base Dialog for a specific inspector dialog |
BuildingEditor | |
BuildingEditorPalette | A palette of building items which can be added to the editor |
BuildingEditorWidget | The parent widget of the building editor, level widget and scale widget |
BuildingMaker | Create and manage 3D visuals of a building |
BuildingModelManip | Manipulate a 3D visual associated to a 2D editor item |
CloneWindow | A dialog window used to set some parameters before cloning a simulation |
CollisionConfig | A tab for configuring collision properties of a link |
CollisionConfigData | A class of widgets used for configuring collision properties |
ConfigChildWidget | A convenience widget that also holds pointers to a list of its child widgets |
ConfigWidget | A widget generated from a google protobuf message |
Conversions | Conversions Conversions.hh gui/Conversions.hh |
CurrentTimeItem | Item which represents the current time within the view |
DataLogger | A widget that provides data logging functionality |
DeleteAction | Custom delete action |
DensityConfigWidget | A widget for configuring density properties |
DirectionalLightMaker | Used to insert a new directional light into the scene |
DoorItem | 2D representation of a door |
EditableLabel | Editable Label |
Editor | Base class for editors, such as BuildingEditor and TerrainEditor |
EditorItem | Base class of an item in the editor |
EditorMaterialListener | Ogre material listener |
EditorMaterialSwitcher | Material switcher for the model editor used to toggle the material of the model |
EditorRenderTargetListener | Ogre render target listener |
EditorView | Control the editor view and manage contents in the editor scene |
EntityMaker | To make an entity, base class |
EnumConfigWidget | A widget for configuring enum values |
Events | |
ExportDialog | Dialog for saving to file |
ExtrudeDialog | Dialog for saving to file |
FloorItem | 2D representation of a floor |
GeometryConfigWidget | A widget for configuring geometry properties |
GLWidget | |
GrabberHandle | |
GraphScene | A scene of 2D graph nodes and edges |
GraphView | A view for the graph scene |
GridLines | 2D grid lines |
GroupWidget | A collapsible widget that holds child widgets |
ImageFrame | Frame that draws an image when a paintevent is received |
ImagesView | |
ImageView | |
ImportDialog | Dialog for saving to file |
ImportImageDialog | |
ImportImageView | Control the import image view and manage contents in the scene |
IncrementalPlot | A plotting widget that handles incremental addition of data |
InsertModelWidget | |
IntrospectionCurveHandler | Manages and updates curves based on introspection data |
JointControlWidget | Gui/JointControlWidget.hh |
JointCreationDialog | A class to inspect and modify joints |
JointData | Helper class to store joint data |
JointForceControl | Widget to control joints via application of force |
JointInspector | A class to inspect and modify joints |
JointMaker | Handles the creation of joints in the model editor |
JointPIDPosControl | Widget to control joints via application of position PID controller |
JointPIDVelControl | Widget to control joints via application of a velocity PID controller |
LaserView | |
LayersWidget | A widget that manages visualization layers |
Level | A convenient structure for storing level information |
LevelInspectorDialog | Dialog for configuring a building level |
LevelWidget | A widget for adding and changing building levels |
LightMaker | Used to insert a new light into the scene |
LinkConfig | A tab for configuring properties of a link |
LinkData | Helper class to store link data |
LinkInspector | |
LogPlayView | View for the timeline |
LogPlayWidget | Widget which displays log playback options |
MainWindow | |
MeasureItem | Measurement lines and values |
MEUserCmd | Class which represents a user command, which can be "undone" and "redone" |
MEUserCmdManager | Class which manages user commands in the model editor |
ModelAlign | A gui tool for aligning models |
ModelCreator | Create and manage 3D visuals of a model with links, nested models and joints |
ModelData | |
ModelEditor | Interface to the terrain editor |
ModelEditorPalette | A palette of model items which can be added to the editor |
ModelListWidget | |
ModelMaker | Used to insert new models into the scene |
ModelManipulator | Manipulator tool for translating/rotating/scaling models and links |
ModelPluginData | Helper class to store model plugin data |
ModelPluginInspector | Inspector for model plugin properties |
ModelRightMenu | Displays a menu when the right mouse button has been pressed |
ModelSnap | A gui tool for snapping one model to another |
ModelTreeWidget | A widget that displays model properties |
NestedModelData | Helper class to store nested models data |
OculusWindow | A widget that renders a camera view suitable for the Oculus Rift |
Palette | A palette for the plot window, where plottable items can be dragged from |
PlotCanvas | Plot canvas |
PlotCurve | Plot Curve data |
PlotManager | A class that connects simulation data with the plotting tool |
PlotTracker | Mouse hover tracking |
PlotWindow | Plot window |
PointLightMaker | Used to insert a new point light into the scene |
RectItem | 2D rectangle |
RenderWidget | |
RestUiLoginDialog | Provides a means to login to a webservice |
RotateHandle | Handle for rotating an editor item |
SaveEntityDialog | Dialog for saving to file |
ScaleWidget | Widget that displays the scale (zoom level) of the editor |
SchematicViewWidget | The parent widget of the CML editor |
SearchModel | Customize the proxy model to display search results |
SegmentItem | 2D line segment |
SpaceNav | Interface to the space navigator joystick |
SplashScreen | Splash screen that displays an icon and a message |
SpotLightMaker | Used to insert a new spot light into the scene |
StairsInspectorDialog | Dialog for configuring a staircase item |
StairsItem | 2D representation of a staircase |
TerrainEditor | Interface to the terrain editor |
TerrainEditorPalette | A palette of building items which can be added to the editor |
TextView | |
TimePanel | |
TimeWidget | |
ToolsWidget | A widget that manages all the tools on the right side of the render widget |
TopicCurveHandler | Manages and updates curves based on topic data |
TopicSelector | A widget that provides a list of topics to select from |
TopicView | Base class for widgets that display topic data |
TopToolbar | Toolbar on the top of the main window |
UserCmdHistory | Class which manages user commands in the client side |
VariablePill | A variable pill |
VariablePillContainer | A container for holding variable pills |
VideoRecorder | Helper class for recording the user camera to a video file |
ViewAngleWidget | A gui widget for changing the camera view angle |
ViewFactory | The view factory creates GUI widgets to visualize data on a topic |
ViewState | A class for managing view visualization states |
VisualConfig | A tab for configuring visual properties of a link |
VisualConfigData | A class of widgets used for configuring visual properties |
WallInspectorDialog | Dialog for configuring a wall item |
WallSegmentItem | 2D representation of a wall |
WindowDoorInspectorDialog | Dialog for configuring a window or door item |
WindowItem | 2D representation of a window |
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 |
AdiabaticAtmosphere | Adiabatic atmosphere model based on the troposphere model in the Manual of the ICAO Standard Atmosphere |
Atmosphere | This models a base atmosphere class to serve as a common interface to any derived atmosphere models |
AtmosphereFactory | The atmosphere factory instantiates different atmosphere models |
BallJoint | Base class for a ball joint |
Base | Base class for most physics classes |
BoxShape | Box geometry primitive |
BulletBallJoint | BulletBallJoint class models a ball joint in Bullet |
BulletBoxShape | Bullet box collision |
BulletCollision | Bullet collisions |
BulletCylinderShape | Cylinder collision |
BulletFixedJoint | A fixed joint |
BulletHeightmapShape | Height map collision |
BulletHinge2Joint | A two axis hinge joint |
BulletHingeJoint | A single axis hinge joint |
BulletJoint | Base class for all joints |
BulletLink | Bullet Link class |
BulletMesh | Triangle mesh collision helper class |
BulletMeshShape | Triangle mesh collision |
BulletMotionState | Bullet btMotionState encapsulation |
BulletMultiRayShape | Bullet specific version of MultiRayShape |
BulletPhysics | Bullet physics engine |
BulletPlaneShape | Bullet collision for an infinite plane |
BulletPolylineShape | Bullet polyline shape |
BulletRayShape | Ray shape for bullet |
BulletScrewJoint | A screw joint |
BulletSliderJoint | A slider joint |
BulletSphereShape | Bullet sphere collision |
BulletSurfaceParams | Bullet surface parameters |
BulletTypes | A set of functions for converting between the math types used by gazebo and bullet |
BulletUniversalJoint | A bullet universal joint class |
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 |
DARTFixedJoint | A single axis hinge joint |
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 |
DARTMesh | Triangle mesh collision helper class |
DARTMeshShape | Triangle mesh collision |
DARTModel | DART model class |
DARTMultiRayShape | DART specific version of MultiRayShape |
DARTPhysics | DART physics engine |
DARTPlaneShape | An DART Plane shape |
DARTPolylineShape | DART polyline shape |
DARTRayShape | Ray collision |
DARTScrewJoint | A screw joint |
DARTSliderJoint | A slider joint |
DARTSphereShape | A DART sphere shape |
DARTSurfaceParams | DART surface parameters |
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 |
FixedJoint | A fixed joint rigidly connecting two bodies |
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 |
JointState | Keeps track of state of a physics::Joint |
JointWrench | Wrench information from a joint |
Light | A light entity |
LightState | Store state information of a Light object |
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 |
ODEBallJoint | An ODEBallJoint |
ODEBoxShape | ODE Box shape |
ODECollision | Base class for all ODE collisions |
ODECylinderShape | ODE cylinder shape |
ODEFixedJoint | A fixed joint |
ODEGearboxJoint | A double axis gearbox joint |
ODEHeightmapShape | ODE Height map collision |
ODEHinge2Joint | A two axis hinge joint |
ODEHingeJoint | A single axis hinge joint |
ODEJoint | ODE joint interface |
ODELink | ODE Link class |
ODEMesh | Triangle mesh helper class |
ODEMeshShape | Triangle mesh collision |
ODEMultiRayShape | ODE specific version of MultiRayShape |
ODEPhysics | ODE physics engine |
ODEPlaneShape | An ODE Plane shape |
ODEPolylineShape | ODE polyline shape |
ODERayShape | Ray collision |
ODEScrewJoint | A screw joint |
ODESliderJoint | A slider joint |
ODESphereShape | A ODE sphere shape |
ODESurfaceParams | ODE surface parameters |
ODEUniversalJoint | A universal joint |
PhysicsEngine | Base class for a physics engine |
PhysicsFactory | The physics factory instantiates different physics engines |
PlaneShape | Collision for an infinite plane |
PolylineShape | Polyline geometry primitive |
Population | 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 |
PopulationParams | Stores all the posible parameters that define a population |
Preset | Representation of a preset physics profile |
PresetManager | Class to manage preset physics profiles |
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 |
SimbodyFixedJoint | A fixed joint rigidly connecting two bodies |
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 |
SimbodyMesh | Triangle mesh collision helper 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 |
SimbodyPolylineShape | Simbody polyline shape |
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 |
UserCmd | Class which represents a user command, which can be "undone" and "redone" |
UserCmdManager | Manages user commands from the server side |
Wind | Base class for wind |
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 |
ApplyWrenchVisual | Visualization for the apply wrench GUI |
ArrowVisual | Basic arrow visualization |
AxisVisual | Basic axis visualization |
Camera | Basic camera sensor |
CameraLens | Describes a lens of a camera as amapping function of type r = c1*f*fun(theta/c2+c3) |
CameraVisual | Basic camera visualization |
COMVisual | Basic Center of Mass visualization |
ContactVisual | Contact visualization |
Conversions | Conversions Conversions.hh rendering/Conversions.hh |
CustomGLSLProgramWriter | This overrides ogre's default GLSLProgramWriter to fix a bug in ogre versions <= 1.8 where 'sampler2DShadow' sampler type is missing |
CustomGLSLProgramWriterFactory | A factory to create our own CustomGLSLProgramWriter |
CustomPSSM3 | Custom PSSM shadow receiver that overrides one deficient method in IntegratedPSSM3 |
CustomPSSM3Factory | A factory that enables creation of CustomPSSM3 instances |
CustomPSSMShadowCameraSetup | Parallel Split Shadow Map (PSSM) shadow camera setup |
DepthCamera | Depth camera used to render depth data into an image buffer |
Distortion | Camera distortion based on the Brown-Conrady model |
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 |
GpuLaserData | Struct containing info about a single ray measurement |
GpuLaserDataIterator | Const Bidirectional iterator for laser data |
Grid | Displays a grid of cells, drawn with lines |
Heightmap | Rendering a terrain using heightmap information |
InertiaVisual | Basic Inertia visualization |
JointVisual | Visualization for joints |
LaserVisual | Visualization for laser data |
LensFlare | Camera lens flare compositor |
Light | A light source |
LinkFrameVisual | Visualization for link frames |
LogicalCameraVisual | Logical camera visualization |
MovableText | Movable text |
OculusCamera | A camera used for user visualization of a scene |
OrbitViewController | Orbit view controller |
OriginVisual | Basic world origin visualization |
OrthoViewController | Orthographic view controller |
Projector | Projects a material onto surface, light a light projector |
RayQuery | A Ray Query class used for retrieving mesh data of a visual, adapted from Ogre3D wiki |
RenderEngine | Adaptor to Ogre3d |
RFIDTagVisual | Visualization for RFID tags sensor |
RFIDVisual | Visualization for RFID sensor |
Road2d | |
RTShaderSystem | Implements Ogre's Run-Time Shader system |
Scene | Representation of an entire scene graph |
SelectionObj | Interactive selection object for models and links |
SonarVisual | Visualization for sonar data |
TransmitterVisual | Visualization for the wireless propagation data |
UserCamera | A camera used for user visualization of a scene |
VideoVisual | A visual element that displays a video as a texture |
ViewController | Base class for view controllers |
Visual | A renderable object |
WideAngleCamera | Camera with variable mapping function |
WindowManager | Class to mangage render windows |
WireBox | Draws a wireframe box |
WrenchVisual | Visualization for wrench data |
sensors | Sensors namespace |
AltimeterSensor | AltimeterSensor to provide vertical position and velocity |
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 | GPU based laser sensor |
ImageGaussianNoiseModel | |
ImuSensor | An IMU sensor |
LogicalCameraSensor | A camera sensor that reports locations of objects instead of rendering a scene |
MagnetometerSensor | MagnetometerSensor to provide magnetic field measurement |
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 |
WideAngleCameraSensor | Camera sensor with variable mapping function |
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 |
IntrospectionClient | Addtogroup gazebo_util |
IntrospectionManager | Addtogroup gazebo_util |
LogPlay | |
LogRecord | Addtogroup gazebo_util |
LogRecordParams | Log recording parameters |
ActorPlugin | |
ActuatorPlugin | Plugin for simulating a torque-speed curve for actuators |
ActuatorProperties | Properties for a model of a rotational actuator |
ArduCopterPlugin | Interface ArduCopter from ardupilot stack modeled after SITL/SIM_* |
ArrangePlugin | |
Object | Class to store info about each object |
AttachLightPlugin | A model plugin that enables multiple lights in the world to be attached to links within the model |
BlinkVisualPlugin | Plugin that makes a visual blink between two colors |
BreakableJointPlugin | A plugin for breakable joints, based on a ForceTorque sensor plugin |
BuoyancyPlugin | A plugin that simulates buoyancy of an object immersed in fluid |
CameraPlugin | |
CartDemoPlugin | This plugin drives a four wheeled cart model forward and back by applying a small wheel torque |
CessnaGUIPlugin | A GUI plugin that controls the Cessna model using the keyboard |
CessnaPlugin | Allow moving the control surfaces of a Cessna C-172 plane |
ContactPlugin | A plugin for a contact sensor |
DepthCameraPlugin | |
DiffDrivePlugin | |
ElevatorPlugin | Plugin to control a elevator |
EventSource | The base class for emitting SimEvents |
ExistenceEventSource | |
FiducialCameraPlugin | 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 |
FollowerPlugin | A simple object follower that finds the closest object in a depth image and commands a differential drive vehicle to move towards the object |
ForceTorquePlugin | An base class plugin for custom force torque sensor processing |
GimbalSmall2dPlugin | A plugin for controlling the angle of a gimbal joint |
GpuRayPlugin | |
GravityCompensationPlugin | Plugin that provides gravity compensation |
GUIPlugin | A plugin loaded within the gzclient on startup |
HarnessPlugin | This plugin is designed to lower a model at a controlled rate |
HeightmapLODPlugin | Plugin that sets the heightmap LOD |
HydraDemoPlugin | |
ImuSensorPlugin | An base class plugin for custom imu sensor processing |
InitialVelocityPlugin | |
InRegionEventSource | The event generator class |
JointEventSource | The event generator class |
JointTrajectoryPlugin | |
KeyboardGUIPlugin | A GUI plugin that captures key strokes from gzclient GUI and publishes over gz transport topic ~/keyboard/keypress |
KeyInfo | Store information from SDF for each key |
KeysToJointsPlugin | Control joints in a model based on keypress messages received |
LensFlareSensorPlugin | Plugin that adds lens flare effect to a camera or multicamera sensor |
LiftDragPlugin | A plugin that simulates lift and drag |
LinearBatteryConsumerPlugin | A plugin that manages a linear battery consumer |
LinearBatteryPlugin | A plugin that simulates a linear battery |
LinkPlot3DPlugin | A plugin that traces the trajectory of a link in the rendering scene |
LookAtDemoPlugin | A GUI plugin that demos the ignition::math::Matrix4<T>::LookAt function |
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 |
ModelPropShop | This plugin will generate 5 pictures of a model: perspective, top, front, side, back |
ModelResourceRetriever | |
MudPlugin | |
OccupiedEventSource | A plugin that transmits a message when an in-region event occurs |
PlaneDemoPlugin | A plugin that simulates lift and drag |
PluginT | A class which all plugins must inherit from |
PressurePlugin | A plugin for a tactile pressure sensor |
RandomVelocityPlugin | Plugin that applies a random velocity to a linke periodically |
RayPlugin | A Ray Sensor Plugin |
RaySensorNoisePlugin | A Ray Sensor Noise Plugin |
RazerHydra | |
Region | A region, made of a list of boxes |
RegionEventBoxPlugin | A plugin that fires an event when another model enters the region defined by the size of this model's box visual |
RenderingFixture | |
RestApi | REST interface |
RestException | |
RestUiPlugin | REST user interface plugin |
RestUiWidget | REST user interface widget |
RestWebPlugin | REST web plugin |
RubblePlugin | |
SensorPlugin | A plugin with access to physics::Sensor |
Server | |
ServerFixture | |
SimEventConnector | Gazebo events to detect model creation/deletion |
SimEventsException | |
SimEventsPlugin | |
SimStateEventSource | SimEvent that fires when the simulation is paused/resumed |
SkidSteerDrivePlugin | A gazebo model plugin that controls a four wheel skid-steer robot via a gazebo topic |
SonarPlugin | A sonar sensor plugin |
SphereAtlasDemoPlugin | |
SystemPlugin | A plugin loaded within the gzserver on startup |
TimerGUIPlugin | A GUI plugin that displays a timer |
TouchPlugin | Plugin which checks if this model has touched some specific target for a given time continuously and exclusively |
TransporterPlugin | A plugin that allows models to transport (teleport) to a new location |
VehiclePlugin | |
VisualPlugin | A plugin with access to rendering::Visual |
VolumeProperties | A class for storing the volume properties of a link |
WindPlugin | A plugin that simulates a simple wind model |
WorldPlugin | A plugin with access to physics::World |
gazebo_shared | |
google | |
protobuf | |
compiler | |
cpp | |
GazeboGenerator | Google protobuf message generator for gazebo::msgs |
ignition | |
msgs | |
Ogre | |
SimTK | |
SkyX | |
DEM | Encapsulates a DEM (Digital Elevation Model) file |
gzBtUniversalConstraint | Functions that implement a universal joint/constraint using bullet |
Logplay | Open and playback log files that were recorded using LogRecord |
QTestFixture | Base class for all Gazebo GUI unit tests |
QuadNode | |
Road | Used to render a strip of road |
SensorFactor | The sensor factory; the class is just for namespacing purposes |
SingletonT | Singleton template class |