ROS implementation of the ConveyorBeltPlugin plugin. More...
#include <ROSConveyorBeltPlugin.hh>
Public Member Functions | |
void | Load (physics::ModelPtr _parent, sdf::ElementPtr _sdf) |
Load the plugin. | |
bool | OnControlCommand (osrf_gear::ConveyorBeltControl::Request &_req, osrf_gear::ConveyorBeltControl::Response &_res) |
Receives requests on the conveyor belt's topic. | |
ROSConveyorBeltPlugin () | |
Constructor. | |
virtual | ~ROSConveyorBeltPlugin () |
Destructor. | |
Public Attributes | |
ros::ServiceServer | controlService_ |
Receives service calls to control the conveyor belt. | |
Private Attributes | |
std::string | robotNamespace_ |
for setting ROS name space | |
ros::NodeHandle * | rosnode_ |
ros node handle |
ROS implementation of the ConveyorBeltPlugin plugin.
Definition at line 33 of file ROSConveyorBeltPlugin.hh.
Constructor.
Definition at line 26 of file ROSConveyorBeltPlugin.cc.
ROSConveyorBeltPlugin::~ROSConveyorBeltPlugin | ( | ) | [virtual] |
Destructor.
Definition at line 31 of file ROSConveyorBeltPlugin.cc.
void ROSConveyorBeltPlugin::Load | ( | physics::ModelPtr | _parent, |
sdf::ElementPtr | _sdf | ||
) | [virtual] |
Load the plugin.
[in] | _parent | Pointer to the parent model |
[in] | _sdf | Pointer to the SDF element of the plugin. |
Reimplemented from gazebo::ConveyorBeltPlugin.
Definition at line 37 of file ROSConveyorBeltPlugin.cc.
bool ROSConveyorBeltPlugin::OnControlCommand | ( | osrf_gear::ConveyorBeltControl::Request & | _req, |
osrf_gear::ConveyorBeltControl::Response & | _res | ||
) |
Receives requests on the conveyor belt's topic.
[in] | _req | The desired state of the conveyor belt. |
[in] | _res | If the service succeeded or not. |
Definition at line 69 of file ROSConveyorBeltPlugin.cc.
Receives service calls to control the conveyor belt.
Definition at line 60 of file ROSConveyorBeltPlugin.hh.
for setting ROS name space
Definition at line 54 of file ROSConveyorBeltPlugin.hh.
ros node handle
Definition at line 57 of file ROSConveyorBeltPlugin.hh.