18 #ifndef _GAZEBO_ROS_PLUGINS_ELEVATOR_PLUGIN_H_ 19 #define _GAZEBO_ROS_PLUGINS_ELEVATOR_PLUGIN_H_ 24 #include <gazebo/plugins/ElevatorPlugin.hh> 28 #include <std_msgs/String.h> 46 public:
void Load(physics::ModelPtr _parent, sdf::ElementPtr _sdf);
50 public:
void OnElevator(
const std_msgs::String::ConstPtr &_msg);
boost::thread callbackQueueThread_
virtual ~GazeboRosElevator()
Destructor.
ros::CallbackQueue queue_
Custom Callback Queue.
void OnElevator(const std_msgs::String::ConstPtr &_msg)
Receives messages on the elevator's topic.
ros::NodeHandle * rosnode_
ros node handle
ros::Subscriber elevatorSub_
Subscribes to a topic that controls the elevator.
ROS implementation of the Elevator plugin.
GazeboRosElevator()
Constructor.
void Load(physics::ModelPtr _parent, sdf::ElementPtr _sdf)
Load the plugin.
std::string robotNamespace_
for setting ROS name space
void QueueThread()
Queu to handle callbacks.