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