A | Holding gazebo extension elements in urdf |
gazebo::math::Angle | An angle and related functions |
gazebo::common::Animation | Manages an animation, which is a collection of keyframes and the ability to interpolate between the keyframes |
gazebo::common::NumericAnimation | A numeric animation |
gazebo::common::PoseAnimation | A pose animation |
gazebo::math::Box | Mathematical representation of a box and related functions |
gazebo::common::BVHLoader | Handles loading BVH animation files |
gazebo::transport::CallbackHelper | A helper class to handle callbacks when messages arrive |
gazebo::transport::CallbackHelperT< M > | Callback helper Template |
gazebo::transport::RawCallbackHelper | Used to connect publishers to subscribers, where the subscriber wants the raw data from the publisher |
gazebo::transport::SubscriptionTransport | Transport/transport.hh |
CodeGenerator | |
google::protobuf::compiler::cpp::GazeboGenerator | Google protobuf message generator for gazebo::msgs |
gazebo::common::Color | Defines a color |
gazebo::event::Connection | A class that encapsulates a connection |
gazebo::physics::Contact | A contact between two collisions |
gazebo::physics::ContactManager | Aggregates all the contact information generated by the collision detection engine |
gazebo::rendering::Conversions | Conversions Conversions.hh rendering/Conversions.hh |
sdf::Converter | Convert from one version of SDF to another |
enable_shared_from_this | |
gazebo::physics::Base | Base class for most physics classes |
gazebo::physics::Entity | Base class for all physics objects in Gazebo |
gazebo::physics::Collision | Base class for all collision entities |
gazebo::physics::Link | Link class defines a rigid body entity, containing information on inertia, visual and collision properties of a rigid body |
gazebo::physics::Model | A model is a collection of links, joints, and plugins |
gazebo::physics::Actor | Actor class enables GPU based mesh model / skeleton scriptable animation |
gazebo::physics::Joint | Base class for all joints |
gazebo::physics::Road | For building a Road from SDF |
gazebo::physics::Shape | Base class for all shapes |
gazebo::physics::BoxShape | Box geometry primitive |
gazebo::physics::CylinderShape | Cylinder collision |
gazebo::physics::HeightmapShape | HeightmapShape collision shape builds a heightmap from an image |
gazebo::physics::MultiRayShape | Laser collision contains a set of ray-collisions, structured to simulate a laser range scanner |
gazebo::physics::PlaneShape | Collision for an infinite plane |
gazebo::physics::RayShape | Base class for Ray collision geometry |
gazebo::physics::SphereShape | Sphere collision shape |
gazebo::physics::TrimeshShape | Triangle mesh collision shape |
gazebo::physics::World | The world provides access to all other object within a simulated environment |
gazebo::rendering::Camera | Basic camera sensor |
gazebo::rendering::DepthCamera | Depth camera used to render depth data into an image buffer |
gazebo::rendering::GpuLaser | GPU based laser distance sensor |
gazebo::rendering::UserCamera | A camera used for user visualization of a scene |
gazebo::rendering::Scene | Representation of an entire scene graph |
gazebo::rendering::Visual | A renderable object |
gazebo::rendering::ArrowVisual | Basic arrow visualization |
gazebo::rendering::AxisVisual | Basic axis visualization |
gazebo::rendering::CameraVisual | Basic camera visualization |
gazebo::rendering::COMVisual | Basic Center of Mass visualization |
gazebo::rendering::ContactVisual | Contact visualization |
gazebo::rendering::JointVisual | Visualization for joints |
gazebo::rendering::LaserVisual | Visualization for laser data |
gazebo::rendering::RFIDTagVisual | Visualization for RFID tags sensor |
gazebo::rendering::RFIDVisual | Visualization for RFID sensor |
gazebo::rendering::VideoVisual | A visual element that displays a video as a texture |
gazebo::sensors::Sensor | Base class for sensors |
gazebo::sensors::CameraSensor | Basic camera sensor |
gazebo::sensors::ContactSensor | Contact sensor |
gazebo::sensors::DepthCameraSensor | |
gazebo::sensors::GpuRaySensor | |
gazebo::sensors::ImuSensor | An IMU sensor |
gazebo::sensors::MultiCameraSensor | Multiple camera sensor |
gazebo::sensors::RaySensor | Sensor with one or more rays |
gazebo::sensors::RFIDSensor | Sensor class for RFID type of sensor |
gazebo::sensors::RFIDTag | RFIDTag to interact with RFIDTagSensors |
gazebo::transport::Connection | Single TCP/IP connection manager |
gazebo::transport::Node | A node can advertise and subscribe topics, publish on advertised topics and listen to subscribed topics |
sdf::Element | SDF Element class |
gazebo::event::Event | Base class for all events |
gazebo::event::EventT< void()> | |
gazebo::event::EventT< void(bool)> | |
gazebo::event::EventT< void(const common::UpdateInfo &)> | |
gazebo::event::EventT< void(const float *, unsigned int, unsigned int, unsigned int, const std::string &)> | |
gazebo::event::EventT< void(const std::string &)> | |
gazebo::event::EventT< void(const std::string &, const Contact &)> | |
gazebo::event::EventT< void(const unsigned char *, unsigned int, unsigned int, unsigned int, const std::string &)> | |
gazebo::event::EventT< void(std::string)> | |
gazebo::event::EventT< void(std::string, std::string)> | |
gazebo::event::EventT< T > | A class for event processing |
gazebo::rendering::Events | Base class for rendering events |
gazebo::event::Events | An Event class to get notifications for simulator events |
gazebo::common::Exception | Class for generating exceptions |
gazebo::common::InternalError | Class for generating Internal Gazebo Errors: those errors which should never happend and represent programming bugs |
gazebo::common::AssertionInternalError | Class for generating Exceptions which come from gazebo assertions |
urdf2gazebo::GazeboExtension | |
gazebo::rendering::Grid | Displays a grid of cells, drawn with lines |
gazebo::physics::Gripper | A gripper abstraction |
gazebo::rendering::GUIOverlay | A class that creates a CEGUI overlay on a render window |
gazebo::rendering::Heightmap | Rendering a terrain using heightmap information |
gazebo::common::Image | Encapsulates an image |
gazebo::physics::Inertial | A class for inertial information about a link |
gazebo::transport::IOManager | Manages boost::asio IO |
gazebo::physics::JointController | A class for manipulating physics::Joint |
gazebo::physics::JointWrench | Wrench information from a joint |
gazebo::common::KeyFrame | A key frame in an animation |
gazebo::common::NumericKeyFrame | A keyframe for a NumericAnimation |
gazebo::common::PoseKeyFrame | A keyframe for a PoseAnimation |
gazebo::rendering::Light | A light source |
Logplay | Open and playback log files that were recorded using LogRecord |
gazebo::Master | A ROS Master-like manager that directs gztopic connections, enables each gazebo network client to locate one another for peer-to-peer communication |
gazebo::common::Material | Encapsulates description of a material |
gazebo::math::Matrix3 | A 3x3 matrix class |
gazebo::math::Matrix4 | A 3x3 matrix class |
gazebo::common::Mesh | A 3D mesh |
gazebo::common::MeshCSG | Creates CSG meshes |
gazebo::common::MeshLoader | Base class for loading meshes |
gazebo::common::ColladaLoader | Class used to load Collada mesh files |
gazebo::common::STLLoader | Class used to load STL mesh files |
gazebo::common::MouseEvent | Generic description of a mouse event |
MovableObject | |
gazebo::rendering::MovableText | Movable text |
gazebo::msgs::MsgFactory | A factory that generates protobuf message based on a string type |
gazebo::common::NodeAnimation | Node animation |
gazebo::common::NodeAssignment | Vertex to node weighted assignement for skeleton animation visualization |
gazebo::common::NodeTransform | NodeTransform Skeleton.hh common/common.hh |
sdf::Param | A parameter class |
sdf::ParamT< std::string > | |
sdf::ParamT< T > | Templatized parameter class |
ParamT< T > | |
gazebo::physics::PhysicsEngine | Base class for a physics engine |
gazebo::physics::PhysicsFactory | The physics factory instantiates different physics engines |
gazebo::common::PID | Generic PID controller class |
gazebo::math::Plane | A plane and related functions |
gazebo::PluginT< T > | A class which all plugins must inherit from |
gazebo::PluginT< ModelPlugin > | |
gazebo::ModelPlugin | A plugin with access to physics::Model |
gazebo::PluginT< SensorPlugin > | |
gazebo::SensorPlugin | A plugin with access to physics::Sensor |
gazebo::PluginT< SystemPlugin > | |
gazebo::SystemPlugin | A plugin loaded within the gzserver on startup |
gazebo::PluginT< VisualPlugin > | |
gazebo::VisualPlugin | A plugin loaded within the gzserver on startup |
gazebo::PluginT< WorldPlugin > | |
gazebo::WorldPlugin | A plugin with access to physics::World |
gazebo::math::Pose | Encapsulates a position and rotation in three space |
gazebo::rendering::Projector | Projects a material onto surface, light a light projector |
gazebo::transport::Publication | A publication for a topic |
gazebo::transport::PublicationTransport | Transport/transport.hh |
gazebo::transport::Publisher | A publisher of messages on a topic |
gazebo::math::Quaternion | A quaternion class |
gazebo::math::Rand | Random number generator class |
Renderable | |
gazebo::rendering::MovableText | Movable text |
RenderObjectListener | |
gazebo::rendering::GpuLaser | GPU based laser distance sensor |
Road | Used to render a strip of road |
gazebo::rendering::Road2d | |
gazebo::math::RotationSpline | Spline for rotations |
sdf::SDF | Base SDF class |
SDFBase | |
sdf::Plugin | |
gazebo::rendering::SelectionObj | A graphical selection object |
SensorFactor | The sensor factory; the class is just for namespacing purposes |
gazebo::sensors::SensorFactory | |
gazebo::Server | |
ShaderHelperCg | |
gazebo::rendering::GzTerrainMatGen::SM2Profile::ShaderHelperCg | Keeping the CG shader for reference |
ShaderHelperGLSL | |
gazebo::rendering::GzTerrainMatGen::SM2Profile::ShaderHelperGLSL | Utility class to help with generating shaders for GLSL |
SimpleRenderable | |
gazebo::rendering::DynamicRenderable | Abstract base class providing mechanisms for dynamically growing hardware buffers |
gazebo::rendering::DynamicLines | Class for drawing lines that can change |
gazebo::sensors::SimTimeEvent | |
SingletonT< T > | Singleton template class |
gazebo::common::Console | Message, error, warning functionality |
gazebo::common::LogPlay | |
gazebo::common::LogRecord | Addtogroup gazebo_common |
gazebo::common::MeshManager | Maintains and manages all meshes |
gazebo::common::ModelDatabase | Connects to model database, and has utility functions to find models |
gazebo::common::SystemPaths | Functions to handle getting system paths, keeps track of: |
gazebo::rendering::RenderEngine | Adaptor to Ogre3d |
gazebo::rendering::RTShaderSystem | Implements Ogre's Run-Time Shader system |
gazebo::sensors::SensorManager | Class to manage and update all sensors |
gazebo::sensors::SimTimeEventHandler | Monitors simulation time, and notifies conditions when a specified time has been reached |
gazebo::transport::ConnectionManager | Manager of connections |
gazebo::transport::TopicManager | Manages topics and their subscriptions |
gazebo::util::DiagnosticManager | A diagnostic manager class |
SingletonT< ConnectionManager > | |
SingletonT< Console > | |
SingletonT< DiagnosticManager > | |
SingletonT< LogPlay > | |
SingletonT< LogRecord > | |
SingletonT< MeshManager > | |
SingletonT< ModelDatabase > | |
SingletonT< RenderEngine > | |
SingletonT< RTShaderSystem > | |
SingletonT< SensorManager > | |
SingletonT< SimTimeEventHandler > | |
SingletonT< SystemPaths > | |
SingletonT< TopicManager > | |
SingletonT< WindowManager > | |
gazebo::rendering::WindowManager | Class to mangage render windows |
gazebo::common::Skeleton | A skeleton |
gazebo::common::SkeletonAnimation | Skeleton animation |
gazebo::common::SkeletonNode | A skeleton node |
SM2Profile | |
gazebo::rendering::GzTerrainMatGen::SM2Profile | Shader model 2 profile target |
gazebo::math::Spline | Splines |
gazebo::physics::State | State of an entity |
gazebo::physics::CollisionState | Store state information of a physics::Collision object |
gazebo::physics::JointState | Keeps track of state of a physics::Joint |
gazebo::physics::LinkState | Store state information of a physics::Link object |
gazebo::physics::ModelState | Store state information of a physics::Model object |
gazebo::physics::WorldState | Store state information of a physics::World object |
gazebo::common::SubMesh | A child mesh |
gazebo::transport::SubscribeOptions | Options for a subscription |
gazebo::transport::Subscriber | A subscriber to a topic |
gazebo::physics::SurfaceParams | SurfaceParams defines various Surface contact parameters |
T | |
gazebo::physics::BallJoint< T > | Base class for a ball joint |
gazebo::physics::Hinge2Joint< T > | A two axis hinge joint |
gazebo::physics::HingeJoint< T > | A single axis hinge joint |
gazebo::physics::ScrewJoint< T > | A screw joint, which has both prismatic and rotational DOFs |
gazebo::physics::SliderJoint< T > | A slider joint |
gazebo::physics::UniversalJoint< T > | A universal joint |
task | |
gazebo::transport::ConnectionReadTask | |
TerrainMaterialGeneratorA | |
gazebo::rendering::GzTerrainMatGen | |
gazebo::common::Time | A Time class, can be used to hold wall- or sim-time |
gazebo::common::Timer | A timer class, used to time things in real world walltime |
gazebo::util::DiagnosticTimer | A timer designed for diagnostics |
gazebo::physics::TrajectoryInfo | |
gazebo::common::UpdateInfo | Information for use in an update event |
urdf2gazebo::URDF2Gazebo | |
gazebo::math::Vector2d | Generic double x, y vector |
gazebo::math::Vector2i | Generic integer x, y vector |
gazebo::math::Vector3 | Generic vector containing 3 elements |
gazebo::math::Vector4 | Double Generic x, y, z, w vector |
gazebo::common::Video | Handle video encoding and decoding using libavcodec |
gazebo::rendering::ViewController | Base class for view controllers |
gazebo::rendering::FPSViewController | First Person Shooter style view controller |
gazebo::rendering::OrbitViewController | Orbit view controller |
gazebo::rendering::WireBox | Draws a wireframe box |