Public Member Functions | Private Member Functions | Private Attributes | List of all members
gazebo::GazeboRosElevator Class Reference

ROS implementation of the Elevator plugin. More...

#include <gazebo_ros_elevator.h>

Inheritance diagram for gazebo::GazeboRosElevator:
Inheritance graph
[legend]

Public Member Functions

 GazeboRosElevator ()
 Constructor. More...
 
void Load (physics::ModelPtr _parent, sdf::ElementPtr _sdf)
 Load the plugin. More...
 
void OnElevator (const std_msgs::String::ConstPtr &_msg)
 Receives messages on the elevator's topic. More...
 
virtual ~GazeboRosElevator ()
 Destructor. More...
 

Private Member Functions

void QueueThread ()
 Queu to handle callbacks. More...
 

Private Attributes

boost::thread callbackQueueThread_
 
ros::Subscriber elevatorSub_
 Subscribes to a topic that controls the elevator. More...
 
ros::CallbackQueue queue_
 Custom Callback Queue. More...
 
std::string robotNamespace_
 for setting ROS name space More...
 
ros::NodeHandlerosnode_
 ros node handle More...
 

Detailed Description

ROS implementation of the Elevator plugin.

Definition at line 35 of file gazebo_ros_elevator.h.

Constructor & Destructor Documentation

GazeboRosElevator::GazeboRosElevator ( )

Constructor.

Definition at line 24 of file gazebo_ros_elevator.cpp.

GazeboRosElevator::~GazeboRosElevator ( )
virtual

Destructor.

Definition at line 29 of file gazebo_ros_elevator.cpp.

Member Function Documentation

void GazeboRosElevator::Load ( physics::ModelPtr  _parent,
sdf::ElementPtr  _sdf 
)

Load the plugin.

Parameters
[in]_modelPointer to the Model
[in]_sdfPointer to the SDF element of the plugin.

Definition at line 40 of file gazebo_ros_elevator.cpp.

void GazeboRosElevator::OnElevator ( const std_msgs::String::ConstPtr &  _msg)

Receives messages on the elevator's topic.

Parameters
[in]_msgThe string message that contains a command.

Definition at line 80 of file gazebo_ros_elevator.cpp.

void GazeboRosElevator::QueueThread ( )
private

Queu to handle callbacks.

Definition at line 86 of file gazebo_ros_elevator.cpp.

Member Data Documentation

boost::thread gazebo::GazeboRosElevator::callbackQueueThread_
private

Definition at line 68 of file gazebo_ros_elevator.h.

ros::Subscriber gazebo::GazeboRosElevator::elevatorSub_
private

Subscribes to a topic that controls the elevator.

Definition at line 62 of file gazebo_ros_elevator.h.

ros::CallbackQueue gazebo::GazeboRosElevator::queue_
private

Custom Callback Queue.

Definition at line 65 of file gazebo_ros_elevator.h.

std::string gazebo::GazeboRosElevator::robotNamespace_
private

for setting ROS name space

Definition at line 56 of file gazebo_ros_elevator.h.

ros::NodeHandle* gazebo::GazeboRosElevator::rosnode_
private

ros node handle

Definition at line 59 of file gazebo_ros_elevator.h.


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


gazebo_plugins
Author(s): John Hsu
autogenerated on Tue Apr 6 2021 02:19:40