Tetrapod Project
gazebo::TerrainPlugin Class Reference

#include <terrain_plugin.h>

Inheritance diagram for gazebo::TerrainPlugin:
Collaboration diagram for gazebo::TerrainPlugin:

Public Member Functions

 TerrainPlugin ()
 
virtual ~TerrainPlugin ()
 
virtual void Load (physics::WorldPtr _world, sdf::ElementPtr _sdf)
 The Load function is called by Gazebo when the plugin is inserted into simulation. More...
 
bool ResetSimulation (const std_srvs::Empty::Request &_req, std_srvs::Empty::Response &_res)
 
void InitRos ()
 
void InitRosQueueThreads ()
 
void ProcessQueueThread ()
 

Private Attributes

physics::WorldPtr world
 Pointer to the world. More...
 
std::unique_ptr< ros::NodeHandle > rosNode
 Node used for ROS transport. More...
 
ros::ServiceServer resetSimService
 ROS Reset Simulation Service. More...
 
ros::ServiceClient tetrapodResetService
 
ros::CallbackQueue rosProcessQueue
 ROS callbackque that helps process messages. More...
 
std::thread rosProcessQueueThread
 Thread running the rosProcessQueue. More...
 

Detailed Description

Definition at line 27 of file terrain_plugin.h.

Constructor & Destructor Documentation

◆ TerrainPlugin()

gazebo::TerrainPlugin::TerrainPlugin ( )

Definition at line 6 of file terrain_plugin.cpp.

◆ ~TerrainPlugin()

gazebo::TerrainPlugin::~TerrainPlugin ( )
virtual

Definition at line 9 of file terrain_plugin.cpp.

Member Function Documentation

◆ Load()

void gazebo::TerrainPlugin::Load ( physics::WorldPtr  _world,
sdf::ElementPtr  _sdf 
)
virtual

The Load function is called by Gazebo when the plugin is inserted into simulation.

Parameters
[in]_modelA pointer to the model that the plugin is attached to.
[in]_sdfA pointer to the plugin's SDF element.

Definition at line 37 of file terrain_plugin.cpp.

◆ ResetSimulation()

bool gazebo::TerrainPlugin::ResetSimulation ( const std_srvs::Empty::Request &  _req,
std_srvs::Empty::Response &  _res 
)

Definition at line 77 of file terrain_plugin.cpp.

◆ InitRos()

void gazebo::TerrainPlugin::InitRos ( )

Definition at line 46 of file terrain_plugin.cpp.

◆ InitRosQueueThreads()

void gazebo::TerrainPlugin::InitRosQueueThreads ( )

Definition at line 19 of file terrain_plugin.cpp.

◆ ProcessQueueThread()

void gazebo::TerrainPlugin::ProcessQueueThread ( )

Definition at line 27 of file terrain_plugin.cpp.

Member Data Documentation

◆ world

physics::WorldPtr gazebo::TerrainPlugin::world
private

Pointer to the world.

Definition at line 50 of file terrain_plugin.h.

◆ rosNode

std::unique_ptr<ros::NodeHandle> gazebo::TerrainPlugin::rosNode
private

Node used for ROS transport.

Definition at line 53 of file terrain_plugin.h.

◆ resetSimService

ros::ServiceServer gazebo::TerrainPlugin::resetSimService
private

ROS Reset Simulation Service.

Definition at line 56 of file terrain_plugin.h.

◆ tetrapodResetService

ros::ServiceClient gazebo::TerrainPlugin::tetrapodResetService
private

Definition at line 58 of file terrain_plugin.h.

◆ rosProcessQueue

ros::CallbackQueue gazebo::TerrainPlugin::rosProcessQueue
private

ROS callbackque that helps process messages.

Definition at line 61 of file terrain_plugin.h.

◆ rosProcessQueueThread

std::thread gazebo::TerrainPlugin::rosProcessQueueThread
private

Thread running the rosProcessQueue.

Definition at line 64 of file terrain_plugin.h.


The documentation for this class was generated from the following files: