ActuatorProperties | Properties for a model of a rotational actuator |
Animation | Manages an animation, which is a collection of keyframes and the ability to interpolate between the keyframes |
NumericAnimation | A numeric animation |
PoseAnimation | A pose animation |
Atmosphere | This models a base atmosphere class to serve as a common interface to any derived atmosphere models |
AdiabaticAtmosphere | Adiabatic atmosphere model based on the troposphere model in the Manual of the ICAO Standard Atmosphere |
AtmosphereFactory | The atmosphere factory instantiates different atmosphere models |
AudioDecoder | An audio decoder based on FFMPEG |
btGeneric6DofConstraint | |
gzBtUniversalConstraint | Functions that implement a universal joint/constraint using bullet |
btMotionState | |
BulletMotionState | Bullet btMotionState encapsulation |
BuildingMaker | Create and manage 3D visuals of a building |
BulletMesh | Triangle mesh collision helper class |
BulletTypes | A set of functions for converting between the math types used by gazebo and bullet |
BVHLoader | Handles loading BVH animation files |
CallbackHelper | A helper class to handle callbacks when messages arrive |
CallbackHelperT< M > | Callback helper Template |
RawCallbackHelper | Used to connect publishers to subscribers, where the subscriber wants the raw data from the publisher |
SubscriptionTransport | Transport/transport.hh |
CameraLens | Describes a lens of a camera as amapping function of type r = c1*f*fun(theta/c2+c3) |
CodeGenerator | |
GazeboGenerator | Google protobuf message generator for gazebo::msgs |
Color | Defines a color |
Connection | A class that encapsulates a connection |
Console | Container for loggers, and global logging options (such as verbose vs |
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 |
Conversions | Conversions Conversions.hh rendering/Conversions.hh |
Conversions | Conversions Conversions.hh gui/Conversions.hh |
DARTMesh | Triangle mesh collision helper class |
DARTTypes | A set of functions for converting between the math types used by gazebo and dart |
DEM | Encapsulates a DEM (Digital Elevation Model) file |
Distortion | Camera distortion based on the Brown-Conrady model |
EditorMaterialSwitcher | Material switcher for the model editor used to toggle the material of the model |
enable_shared_from_this | |
Battery | A battery abstraction |
Visual | A renderable object |
ApplyWrenchVisual | Visualization for the apply wrench GUI |
ArrowVisual | Basic arrow visualization |
AxisVisual | Basic axis visualization |
LinkFrameVisual | Visualization for link frames |
CameraVisual | Basic camera visualization |
COMVisual | Basic Center of Mass visualization |
ContactVisual | Contact visualization |
InertiaVisual | Basic Inertia visualization |
JointVisual | Visualization for joints |
LaserVisual | Visualization for laser data |
LogicalCameraVisual | Logical camera visualization |
OriginVisual | Basic world origin visualization |
RFIDTagVisual | Visualization for RFID tags sensor |
RFIDVisual | Visualization for RFID sensor |
Road2d | |
SelectionObj | Interactive selection object for models and links |
SonarVisual | Visualization for sonar data |
TransmitterVisual | Visualization for the wireless propagation data |
VideoVisual | A visual element that displays a video as a texture |
WrenchVisual | Visualization for wrench data |
Sensor | Base class for sensors |
AltimeterSensor | AltimeterSensor to provide vertical position and velocity |
CameraSensor | Basic camera sensor |
DepthCameraSensor | |
WideAngleCameraSensor | Camera sensor with variable mapping function |
ContactSensor | Contact sensor |
ForceTorqueSensor | Sensor for measure force and torque on a joint |
GpsSensor | GpsSensor to provide position measurement |
GpuRaySensor | GPU based laser sensor |
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 |
RaySensor | Sensor with one or more rays |
RFIDSensor | Sensor class for RFID type of sensor |
RFIDTag | RFIDTag to interact with RFIDTagSensors |
SonarSensor | Sensor with sonar cone |
WirelessTransceiver | Sensor class for receiving wireless signals |
WirelessReceiver | Sensor class for receiving wireless signals |
WirelessTransmitter | Transmitter to send wireless signals |
enable_shared_from_this | |
Base | Base class for most physics classes |
Entity | Base class for all physics objects in Gazebo |
Collision | Base class for all collision entities |
BulletCollision | Bullet collisions |
DARTCollision | Base class for all DART collisions |
ODECollision | Base class for all ODE collisions |
SimbodyCollision | Simbody collisions |
Light | A light entity |
Link | Link class defines a rigid body entity, containing information on inertia, visual and collision properties of a rigid body |
BulletLink | Bullet Link class |
DARTLink | DART Link class |
ODELink | ODE Link class |
SimbodyLink | Simbody Link class |
Model | A model is a collection of links, joints, and plugins |
Actor | Actor class enables GPU based mesh model / skeleton scriptable animation |
DARTModel | DART model class |
SimbodyModel | A model is a collection of links, joints, and plugins |
Joint | Base class for all joints |
BulletJoint | Base class for all joints |
BallJoint< BulletJoint > | |
BulletBallJoint | BulletBallJoint class models a ball joint in Bullet |
FixedJoint< BulletJoint > | |
BulletFixedJoint | A fixed joint |
Hinge2Joint< BulletJoint > | |
BulletHinge2Joint | A two axis hinge joint |
HingeJoint< BulletJoint > | |
BulletHingeJoint | A single axis hinge joint |
ScrewJoint< BulletJoint > | |
BulletScrewJoint | A screw joint |
SliderJoint< BulletJoint > | |
BulletSliderJoint | A slider joint |
UniversalJoint< BulletJoint > | |
BulletUniversalJoint | A bullet universal joint class |
DARTJoint | DART joint interface |
BallJoint< DARTJoint > | |
DARTBallJoint | An DARTBallJoint |
FixedJoint< DARTJoint > | |
DARTFixedJoint | A single axis hinge joint |
Hinge2Joint< DARTJoint > | |
DARTHinge2Joint | A two axis hinge joint |
HingeJoint< DARTJoint > | |
DARTHingeJoint | A single axis hinge joint |
ScrewJoint< DARTJoint > | |
DARTScrewJoint | A screw joint |
SliderJoint< DARTJoint > | |
DARTSliderJoint | A slider joint |
UniversalJoint< DARTJoint > | |
DARTUniversalJoint | A universal joint |
ODEJoint | ODE joint interface |
BallJoint< ODEJoint > | |
ODEBallJoint | An ODEBallJoint |
FixedJoint< ODEJoint > | |
ODEFixedJoint | A fixed joint |
GearboxJoint< ODEJoint > | |
ODEGearboxJoint | A double axis gearbox joint |
Hinge2Joint< ODEJoint > | |
ODEHinge2Joint | A two axis hinge joint |
HingeJoint< ODEJoint > | |
ODEHingeJoint | A single axis hinge joint |
ScrewJoint< ODEJoint > | |
ODEScrewJoint | A screw joint |
SliderJoint< ODEJoint > | |
ODESliderJoint | A slider joint |
UniversalJoint< ODEJoint > | |
ODEUniversalJoint | A universal joint |
SimbodyJoint | Base class for all joints |
BallJoint< SimbodyJoint > | |
SimbodyBallJoint | SimbodyBallJoint class models a ball joint in Simbody |
FixedJoint< SimbodyJoint > | |
SimbodyFixedJoint | A fixed joint rigidly connecting two bodies |
Hinge2Joint< SimbodyJoint > | |
SimbodyHinge2Joint | A two axis hinge joint |
HingeJoint< SimbodyJoint > | |
SimbodyHingeJoint | A single axis hinge joint |
ScrewJoint< SimbodyJoint > | |
SimbodyScrewJoint | A screw joint |
SliderJoint< SimbodyJoint > | |
SimbodySliderJoint | A slider joint |
UniversalJoint< SimbodyJoint > | |
SimbodyUniversalJoint | A simbody universal joint class |
Road | For building a Road from SDF |
Shape | Base class for all shapes |
BoxShape | Box geometry primitive |
BulletBoxShape | Bullet box collision |
DARTBoxShape | DART Box shape |
ODEBoxShape | ODE Box shape |
SimbodyBoxShape | Simbody box collision |
CylinderShape | Cylinder collision |
BulletCylinderShape | Cylinder collision |
DARTCylinderShape | DART cylinder shape |
ODECylinderShape | ODE cylinder shape |
SimbodyCylinderShape | Cylinder collision |
HeightmapShape | HeightmapShape collision shape builds a heightmap from an image |
BulletHeightmapShape | Height map collision |
DARTHeightmapShape | DART Height map collision |
ODEHeightmapShape | ODE Height map collision |
SimbodyHeightmapShape | Height map collision |
MapShape | Creates box extrusions based on an image |
MeshShape | Triangle mesh collision shape |
BulletMeshShape | Triangle mesh collision |
DARTMeshShape | Triangle mesh collision |
ODEMeshShape | Triangle mesh collision |
SimbodyMeshShape | Triangle mesh collision |
MultiRayShape | Laser collision contains a set of ray-collisions, structured to simulate a laser range scanner |
BulletMultiRayShape | Bullet specific version of MultiRayShape |
DARTMultiRayShape | DART specific version of MultiRayShape |
ODEMultiRayShape | ODE specific version of MultiRayShape |
SimbodyMultiRayShape | Simbody specific version of MultiRayShape |
PlaneShape | Collision for an infinite plane |
BulletPlaneShape | Bullet collision for an infinite plane |
DARTPlaneShape | An DART Plane shape |
ODEPlaneShape | An ODE Plane shape |
SimbodyPlaneShape | Simbody collision for an infinite plane |
PolylineShape | Polyline geometry primitive |
BulletPolylineShape | Bullet polyline shape |
DARTPolylineShape | DART polyline shape |
ODEPolylineShape | ODE polyline shape |
SimbodyPolylineShape | Simbody polyline shape |
RayShape | Base class for Ray collision geometry |
BulletRayShape | Ray shape for bullet |
DARTRayShape | Ray collision |
ODERayShape | Ray collision |
SimbodyRayShape | Ray shape for simbody |
SphereShape | Sphere collision shape |
BulletSphereShape | Bullet sphere collision |
DARTSphereShape | A DART sphere shape |
ODESphereShape | A ODE sphere shape |
SimbodySphereShape | Simbody sphere collision |
World | The world provides access to all other object within a simulated environment |
Camera | Basic camera sensor |
DepthCamera | Depth camera used to render depth data into an image buffer |
GpuLaser | GPU based laser distance sensor |
OculusCamera | A camera used for user visualization of a scene |
UserCamera | A camera used for user visualization of a scene |
WideAngleCamera | Camera with variable mapping function |
Light | A light source |
Scene | Representation of an entire scene graph |
Connection | Single TCP/IP connection manager |
Node | A node can advertise and subscribe topics, publish on advertised topics and listen to subscribed topics |
EntityMaker | To make an entity, base class |
LightMaker | Used to insert a new light into the scene |
DirectionalLightMaker | Used to insert a new directional light into the scene |
PointLightMaker | Used to insert a new point light into the scene |
SpotLightMaker | Used to insert a new spot light into the scene |
ModelMaker | Used to insert new models into the scene |
Event | Base class for all events |
EventT< bool()> | |
EventT< void()> | |
EventT< void(bool)> | |
EventT< void(bool, bool)> | |
EventT< void(const common::UpdateInfo &)> | |
EventT< void(const int32_t)> | |
EventT< void(const msgs::Light &)> | |
EventT< void(const msgs::Model &)> | |
EventT< void(const std::string &)> | |
EventT< void(const std::string &, const ignition::math::Pose3d &, const bool)> | |
EventT< void(const std::string &, const ignition::math::Vector3d &)> | |
EventT< void(const unsigned char *, unsigned int, unsigned int, unsigned int, const std::string &)> | |
EventT< void(double)> | |
EventT< void(int)> | |
EventT< void(int, std::string)> | |
EventT< void(QColor)> | |
EventT< void(QString)> | |
EventT< void(sdf::ElementPtr)> | |
EventT< void(sdf::ElementPtr, const std::string &, const std::string &, const uint32_t)> | |
EventT< void(sdf::ElementPtr, std::string)> | |
EventT< void(std::string)> | |
EventT< void(std::string, bool)> | |
EventT< void(std::string, ignition::math::Pose3d)> | |
EventT< void(std::string, std::map< std::string, ignition::math::Vector3d >)> | |
EventT< void(std::string, std::string)> | |
EventT< void(std::string, std::string, std::string, bool)> | |
EventT< void(std::string, std::string, std::string, bool, bool)> | |
EventT< void(std::string, std::string, std::string, std::string, std::string)> | |
EventT< T > | A class for event processing |
Events | |
Events | Base class for rendering events |
Events | |
Events | An Event class to get notifications for simulator events |
Events | |
EventSource | The base class for emitting SimEvents |
ExistenceEventSource | |
InRegionEventSource | The event generator class |
JointEventSource | The event generator class |
OccupiedEventSource | A plugin that transmits a message when an in-region event occurs |
SimStateEventSource | SimEvent that fires when the simulation is paused/resumed |
Exception | Class for generating exceptions |
InternalError | Class for generating Internal Gazebo Errors: those errors which should never happend and represent programming bugs |
AssertionInternalError | Class for generating Exceptions which come from gazebo assertions |
exception | STL class |
runtime_error | STL class |
SvgError | Handles errors during SVG parsing |
RestException | |
SimEventsException | |
FrictionPyramid | Parameters used for friction pyramid model |
GLSLProgramWriter | |
CustomGLSLProgramWriter | This overrides ogre's default GLSLProgramWriter to fix a bug in ogre versions <= 1.8 where 'sampler2DShadow' sampler type is missing |
GpuLaserData | Struct containing info about a single ray measurement |
GpuLaserDataIterator< F > | Const Bidirectional iterator for laser data |
Grid | Displays a grid of cells, drawn with lines |
Gripper | A gripper abstraction |
GTSMeshUtils | Creates GTS utilities for meshes |
Heightmap | Rendering a terrain using heightmap information |
HeightmapData | Encapsulates a generic heightmap data file |
Dem | |
ImageHeightmap | Encapsulates an image that will be interpreted as a heightmap |
HeightmapDataLoader | Helper class for loading heightmap data |
Image | Encapsulates an image |
Inertial | A class for inertial information about a link |
IntegratedPSSM3 | |
CustomPSSM3 | Custom PSSM shadow receiver that overrides one deficient method in IntegratedPSSM3 |
IntrospectionClient | Addtogroup gazebo_util |
IntrospectionCurveHandler | Manages and updates curves based on introspection data |
IOManager | Manages boost::asio IO |
ios_base | STL class |
basic_ios< Char > | STL class |
basic_ostream< Char > | STL class |
ostream | STL class |
FileLogger | A logger that outputs messages to a file |
Logger | Terminal logger |
JointController | A class for manipulating physics::Joint |
JointWrench | Wrench information from a joint |
KeyEvent | Generic description of a keyboard event |
KeyFrame | A key frame in an animation |
NumericKeyFrame | A keyframe for a NumericAnimation |
PoseKeyFrame | A keyframe for a PoseAnimation |
KeyInfo | Store information from SDF for each key |
LensFlare | Camera lens flare compositor |
Level | A convenient structure for storing level information |
Listener | |
EditorMaterialListener | Ogre material listener |
Listener | |
WideAngleCamera | Camera with variable mapping function |
LocalResourceRetriever | |
ModelResourceRetriever | |
Logplay | Open and playback log files that were recorded using LogRecord |
LogRecordParams | Log recording parameters |
Master | A manager that directs topic connections, enables each gazebo network client to locate one another for peer-to-peer communication |
Material | Encapsulates description of a material |
MaterialDensity | Encapsulates density types |
Mesh | A 3D mesh |
MeshCSG | Creates CSG meshes |
MeshExporter | Base class for exporting meshes |
ColladaExporter | Class used to export Collada mesh files |
MeshLoader | Base class for loading meshes |
ColladaLoader | Class used to load Collada mesh files |
OBJLoader | Class used to load obj mesh files |
STLLoader | Class used to load STL mesh files |
MEUserCmd | Class which represents a user command, which can be "undone" and "redone" |
ModelData | |
MouseEvent | Generic description of a mouse event |
MovableObject | |
MovableText | Movable text |
MovingWindowFilter< T > | Base class for MovingWindowFilter |
MsgFactory | A factory that generates protobuf message based on a string type |
NestedModelData | Helper class to store nested models data |
NodeAnimation | Node animation |
NodeAssignment | Vertex to node weighted assignement for skeleton animation visualization |
NodeTransform | NodeTransform Skeleton.hh common/common.hh |
Noise | Noise models for sensor output signals |
GaussianNoiseModel | Gaussian noise class |
ImageGaussianNoiseModel | |
NoiseFactory | Use this noise manager for creating and loading noise models |
ArrangePlugin::Object | Class to store info about each object |
ODEMesh | Triangle mesh helper class |
ParamT< T > | |
PhysicsEngine | Base class for a physics engine |
BulletPhysics | Bullet physics engine |
DARTPhysics | DART physics engine |
ODEPhysics | ODE physics engine |
SimbodyPhysics | Simbody physics engine |
PhysicsFactory | The physics factory instantiates different physics engines |
PID | Generic PID controller class |
PlotCurve | Plot Curve data |
PluginT< T > | A class which all plugins must inherit from |
PluginT< GUIPlugin > | |
GUIPlugin | A plugin loaded within the gzclient on startup |
CessnaGUIPlugin | A GUI plugin that controls the Cessna model using the keyboard |
KeyboardGUIPlugin | A GUI plugin that captures key strokes from gzclient GUI and publishes over gz transport topic ~/keyboard/keypress |
LookAtDemoPlugin | A GUI plugin that demos the ignition::math::Matrix4<T>::LookAt function |
TimerGUIPlugin | A GUI plugin that displays a timer |
PluginT< ModelPlugin > | |
ModelPlugin | A plugin with access to physics::Model |
ActorPlugin | |
ActuatorPlugin | Plugin for simulating a torque-speed curve for actuators |
ArduCopterPlugin | Interface ArduCopter from ardupilot stack modeled after SITL/SIM_* |
AttachLightPlugin | A model plugin that enables multiple lights in the world to be attached to links within the model |
BuoyancyPlugin | A plugin that simulates buoyancy of an object immersed in fluid |
CartDemoPlugin | This plugin drives a four wheeled cart model forward and back by applying a small wheel torque |
CessnaPlugin | Allow moving the control surfaces of a Cessna C-172 plane |
DiffDrivePlugin | |
ElevatorPlugin | Plugin to control a elevator |
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 |
GimbalSmall2dPlugin | A plugin for controlling the angle of a gimbal joint |
GravityCompensationPlugin | Plugin that provides gravity compensation |
HarnessPlugin | This plugin is designed to lower a model at a controlled rate |
HydraDemoPlugin | |
InitialVelocityPlugin | |
JointTrajectoryPlugin | |
KeysToJointsPlugin | Control joints in a model based on keypress messages received |
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 |
MudPlugin | |
PlaneDemoPlugin | A plugin that simulates lift and drag |
RandomVelocityPlugin | Plugin that applies a random velocity to a linke periodically |
RegionEventBoxPlugin | A plugin that fires an event when another model enters the region defined by the size of this model's box visual |
SkidSteerDrivePlugin | A gazebo model plugin that controls a four wheel skid-steer robot via a gazebo topic |
SphereAtlasDemoPlugin | |
TouchPlugin | Plugin which checks if this model has touched some specific target for a given time continuously and exclusively |
VehiclePlugin | |
PluginT< SensorPlugin > | |
SensorPlugin | A plugin with access to physics::Sensor |
BreakableJointPlugin | A plugin for breakable joints, based on a ForceTorque sensor plugin |
CameraPlugin | |
ContactPlugin | A plugin for a contact sensor |
DepthCameraPlugin | |
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 |
ForceTorquePlugin | An base class plugin for custom force torque sensor processing |
GpuRayPlugin | |
ImuSensorPlugin | An base class plugin for custom imu sensor processing |
LensFlareSensorPlugin | Plugin that adds lens flare effect to a camera or multicamera sensor |
PressurePlugin | A plugin for a tactile pressure sensor |
RayPlugin | A Ray Sensor Plugin |
RaySensorNoisePlugin | A Ray Sensor Noise Plugin |
SonarPlugin | A sonar sensor plugin |
PluginT< SystemPlugin > | |
SystemPlugin | A plugin loaded within the gzserver on startup |
ModelPropShop | This plugin will generate 5 pictures of a model: perspective, top, front, side, back |
RestUiPlugin | REST user interface plugin |
RestWebPlugin | REST web plugin |
PluginT< VisualPlugin > | |
VisualPlugin | A plugin with access to rendering::Visual |
BlinkVisualPlugin | Plugin that makes a visual blink between two colors |
HeightmapLODPlugin | Plugin that sets the heightmap LOD |
PluginT< WorldPlugin > | |
WorldPlugin | A plugin with access to physics::World |
ArrangePlugin | |
RazerHydra | |
RubblePlugin | |
SimEventsPlugin | |
TransporterPlugin | A plugin that allows models to transport (teleport) to a new location |
WindPlugin | A plugin that simulates a simple wind model |
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 |
ProgramWriterFactory | |
CustomGLSLProgramWriterFactory | A factory to create our own CustomGLSLProgramWriter |
Projector | Projects a material onto surface, light a light projector |
PSSMShadowCameraSetup | |
CustomPSSMShadowCameraSetup | Parallel Split Shadow Map (PSSM) shadow camera setup |
Publication | A publication for a topic |
PublicationTransport | Transport/transport.hh |
Publisher | A publisher of messages on a topic |
QAction | |
DeleteAction | Custom delete action |
QDialog | |
ApplyWrenchDialog | Dialog for applying force and torque to a model |
BaseInspectorDialog | Base Dialog for a specific inspector dialog |
LevelInspectorDialog | Dialog for configuring a building level |
StairsInspectorDialog | Dialog for configuring a staircase item |
WallInspectorDialog | Dialog for configuring a wall item |
WindowDoorInspectorDialog | Dialog for configuring a window or door item |
CloneWindow | A dialog window used to set some parameters before cloning a simulation |
DataLogger | A widget that provides data logging functionality |
ExportDialog | Dialog for saving to file |
ExtrudeDialog | Dialog for saving to file |
ImportDialog | Dialog for saving to file |
ImportImageDialog | |
JointCreationDialog | A class to inspect and modify joints |
JointInspector | A class to inspect and modify joints |
LinkInspector | |
ModelPluginInspector | Inspector for model plugin properties |
RestUiLoginDialog | Provides a means to login to a webservice |
SaveEntityDialog | Dialog for saving to file |
TopicSelector | A widget that provides a list of topics to select from |
TopicView | Base class for widgets that display topic data |
ImagesView | |
ImageView | |
LaserView | |
TextView | |
QFrame | |
ConfigChildWidget | A convenience widget that also holds pointers to a list of its child widgets |
DensityConfigWidget | A widget for configuring density properties |
EnumConfigWidget | A widget for configuring enum values |
GeometryConfigWidget | A widget for configuring geometry properties |
ImageFrame | Frame that draws an image when a paintevent is received |
TopToolbar | Toolbar on the top of the main window |
QGraphicsItem | |
GrabberHandle | |
GridLines | 2D grid lines |
RotateHandle | Handle for rotating an editor item |
QGraphicsLineItem | |
SegmentItem | 2D line segment |
MeasureItem | Measurement lines and values |
WallSegmentItem | 2D representation of a wall |
QGraphicsRectItem | |
CurrentTimeItem | Item which represents the current time within the view |
RectItem | 2D rectangle |
DoorItem | 2D representation of a door |
FloorItem | 2D representation of a floor |
StairsItem | 2D representation of a staircase |
WindowItem | 2D representation of a window |
QGraphicsView | |
EditorView | Control the editor view and manage contents in the editor scene |
GraphView | A view for the graph scene |
ImportImageView | Control the import image view and manage contents in the scene |
LogPlayView | View for the timeline |
QGVScene | |
GraphScene | A scene of 2D graph nodes and edges |
QMainWindow | |
MainWindow | |
QObject | |
BuildingModelManip | Manipulate a 3D visual associated to a 2D editor item |
CurrentTimeItem | Item which represents the current time within the view |
Editor | Base class for editors, such as BuildingEditor and TerrainEditor |
BuildingEditor | |
ModelEditor | Interface to the terrain editor |
TerrainEditor | Interface to the terrain editor |
EditorItem | Base class of an item in the editor |
RectItem | 2D rectangle |
SegmentItem | 2D line segment |
JointData | Helper class to store joint data |
JointMaker | Handles the creation of joints in the model editor |
LinkData | Helper class to store link data |
ModelCreator | Create and manage 3D visuals of a model with links, nested models and joints |
ModelPluginData | Helper class to store model plugin data |
ModelRightMenu | Displays a menu when the right mouse button has been pressed |
SplashScreen | Splash screen that displays an icon and a message |
UserCmdHistory | Class which manages user commands in the client side |
MEUserCmdManager | Class which manages user commands in the model editor |
ViewState | A class for managing view visualization states |
QTestFixture | Base class for all Gazebo GUI unit tests |
QSortFilterProxyModel | |
SearchModel | Customize the proxy model to display search results |
QuadNode | |
QWidget | |
AlignWidget | A gui widget for aligning models |
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 |
CollisionConfig | A tab for configuring collision properties of a link |
CollisionConfigData | A class of widgets used for configuring collision properties |
ConfigWidget | A widget generated from a google protobuf message |
EditableLabel | Editable Label |
GLWidget | |
GroupWidget | A collapsible widget that holds child widgets |
InsertModelWidget | |
JointControlWidget | Gui/JointControlWidget.hh |
JointForceControl | Widget to control joints via application of force |
JointPIDPosControl | Widget to control joints via application of position PID controller |
JointPIDVelControl | Widget to control joints via application of a velocity PID controller |
LayersWidget | A widget that manages visualization layers |
LevelWidget | A widget for adding and changing building levels |
LinkConfig | A tab for configuring properties of a link |
LogPlayWidget | Widget which displays log playback options |
ModelEditorPalette | A palette of model items which can be added to the editor |
ModelListWidget | |
ModelTreeWidget | A widget that displays model properties |
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 |
PlotWindow | Plot window |
RenderWidget | |
ScaleWidget | Widget that displays the scale (zoom level) of the editor |
SchematicViewWidget | The parent widget of the CML editor |
TerrainEditorPalette | A palette of building items which can be added to the editor |
TimePanel | |
TimeWidget | |
ToolsWidget | A widget that manages all the tools on the right side of the render widget |
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 |
VisualConfig | A tab for configuring visual properties of a link |
VisualConfigData | A class of widgets used for configuring visual properties |
GUIPlugin | A plugin loaded within the gzclient on startup |
RestUiWidget | REST user interface widget |
QwtPlot | |
IncrementalPlot | A plotting widget that handles incremental addition of data |
QwtPlotPicker | |
PlotTracker | Mouse hover tracking |
RayQuery | A Ray Query class used for retrieving mesh data of a visual, adapted from Ogre3D wiki |
Region | A region, made of a list of boxes |
Renderable | |
MovableText | Movable text |
RenderObjectListener | |
GpuLaser | GPU based laser distance sensor |
RenderTargetListener | |
EditorRenderTargetListener | Ogre render target listener |
RestApi | REST interface |
Road | Used to render a strip of road |
SemanticVersion | Version comparison class based on Semantic Versioning 2.0.0 http://semver.org/ Compares versions and converts versions from string |
SensorFactor | The sensor factory; the class is just for namespacing purposes |
SensorFactory | |
Server | |
SimbodyMesh | Triangle mesh collision helper class |
SimEventConnector | Gazebo events to detect model creation/deletion |
SimpleRenderable | |
DynamicRenderable | Abstract base class providing mechanisms for dynamically growing hardware buffers |
DynamicLines | Class for drawing lines that can change |
SingletonT< T > | Singleton template class |
SingletonT< ConnectionManager > | |
ConnectionManager | Manager of connections |
SingletonT< DiagnosticManager > | |
DiagnosticManager | A diagnostic manager class |
SingletonT< FuelModelDatabase > | |
FuelModelDatabase | Connects to an Igniiton Fuel model database, and has utility functions to find models |
SingletonT< IntrospectionManager > | |
IntrospectionManager | Addtogroup gazebo_util |
SingletonT< LogPlay > | |
LogPlay | |
SingletonT< LogRecord > | |
LogRecord | Addtogroup gazebo_util |
SingletonT< MeshManager > | |
MeshManager | Maintains and manages all meshes |
SingletonT< ModelAlign > | |
ModelAlign | A gui tool for aligning models |
SingletonT< ModelDatabase > | |
ModelDatabase | Connects to model database, and has utility functions to find models |
SingletonT< ModelManipulator > | |
ModelManipulator | Manipulator tool for translating/rotating/scaling models and links |
SingletonT< ModelSnap > | |
ModelSnap | A gui tool for snapping one model to another |
SingletonT< PlotManager > | |
PlotManager | A class that connects simulation data with the plotting tool |
SingletonT< RenderEngine > | |
RenderEngine | Adaptor to Ogre3d |
SingletonT< RTShaderSystem > | |
RTShaderSystem | Implements Ogre's Run-Time Shader system |
SingletonT< SensorManager > | |
SensorManager | Class to manage and update all sensors |
SingletonT< SystemPaths > | |
SystemPaths | Functions to handle getting system paths, keeps track of: |
SingletonT< TopicManager > | |
TopicManager | Manages topics and their subscriptions |
Skeleton | A skeleton |
SkeletonAnimation | Skeleton animation |
SkeletonNode | A skeleton node |
SpaceNav | Interface to the space navigator joystick |
SphericalCoordinates | Convert spherical coordinates for planetary surfaces |
State | State of an entity |
CollisionState | Store state information of a physics::Collision object |
JointState | Keeps track of state of a physics::Joint |
LightState | Store state information of a Light object |
LinkState | Store state information of a physics::Link object |
ModelState | Store state information of a physics::Model object |
WorldState | Store state information of a physics::World object |
stringbuf | |
FileLogger::Buffer | String buffer for the file logger |
Logger::Buffer | String buffer for the base logger |
SubMesh | A child mesh |
SubRenderStateFactory | |
CustomPSSM3Factory | A factory that enables creation of CustomPSSM3 instances |
SubscribeOptions | Options for a subscription |
Subscriber | A subscriber to a topic |
SurfaceParams | SurfaceParams defines various Surface contact parameters |
BulletSurfaceParams | Bullet surface parameters |
DARTSurfaceParams | DART surface parameters |
ODESurfaceParams | ODE surface parameters |
SVGCommand | SVG command data structure |
SVGLoader | A loader for SVG files |
SVGPath | An SVG path element data structure |
Test | |
ServerFixture | |
RenderingFixture | |
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 |
DiagnosticTimer | A timer designed for diagnostics |
TopicCurveHandler | Manages and updates curves based on topic data |
TrajectoryInfo | Information about a trajectory for an Actor |
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 |
UserCmd | Class which represents a user command, which can be "undone" and "redone" |
UserCmdManager | Manages user commands from the server side |
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 |
ViewController | Base class for view controllers |
FPSViewController | First Person Shooter style view controller |
OrbitViewController | Orbit view controller |
OrthoViewController | Orthographic view controller |
ViewFactory | The view factory creates GUI widgets to visualize data on a topic |
VolumeProperties | A class for storing the volume properties of a link |
Wind | Base class for wind |
WindowManager | Class to mangage render windows |
WireBox | Draws a wireframe box |
T | |
BallJoint< T > | Base class for a ball joint |
FixedJoint< T > | A fixed joint rigidly connecting two bodies |
GearboxJoint< T > | A double axis gearbox joint |
Hinge2Joint< T > | A two axis hinge joint |
HingeJoint< T > | A single axis hinge joint |
ScrewJoint< T > | A screw joint, which has both prismatic and rotational DOFs |
SliderJoint< T > | A slider joint |
UniversalJoint< T > | A universal joint |