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

ROS implementation of the ConveyorBeltPlugin plugin. More...

#include <ROSAGVPlugin.hh>

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

Public Member Functions

void Load (physics::ModelPtr _parent, sdf::ElementPtr _sdf)
 Load the plugin. More...
 
bool OnCommand (osrf_gear::AGVControl::Request &_req, osrf_gear::AGVControl::Response &_res)
 Receives requests on the conveyor belt's topic. More...
 
 ROSAGVPlugin ()
 Constructor. More...
 
virtual ~ROSAGVPlugin ()
 Destructor. More...
 

Private Attributes

std::string agvName
 Name of the AGV. More...
 
gazebo::common::PoseAnimationPtr anim
 Robot animation. More...
 
gazebo::physics::ModelPtr model
 Pointer to the model. More...
 
std::string robotNamespace
 for setting ROS name space More...
 
ros::NodeHandlerosnode
 ros node handle More...
 
ros::ServiceServer rosService
 Receives service calls for controlling the AGV. More...
 
ros::ServiceClient rosSubmitTrayClient
 Client for submitting trays for inspection. More...
 

Detailed Description

ROS implementation of the ConveyorBeltPlugin plugin.

Definition at line 31 of file ROSAGVPlugin.hh.

Constructor & Destructor Documentation

ROSAGVPlugin::ROSAGVPlugin ( )

Constructor.

Definition at line 29 of file ROSAGVPlugin.cc.

ROSAGVPlugin::~ROSAGVPlugin ( )
virtual

Destructor.

Definition at line 34 of file ROSAGVPlugin.cc.

Member Function Documentation

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

Load the plugin.

Parameters
[in]_parentPointer to the parent model
[in]_sdfPointer to the SDF element of the plugin.

Definition at line 40 of file ROSAGVPlugin.cc.

bool ROSAGVPlugin::OnCommand ( osrf_gear::AGVControl::Request &  _req,
osrf_gear::AGVControl::Response &  _res 
)

Receives requests on the conveyor belt's topic.

Parameters
[in]_reqThe desired state of the conveyor belt.
[in]_resIf the service succeeded or not.

Definition at line 115 of file ROSAGVPlugin.cc.

Member Data Documentation

std::string gazebo::ROSAGVPlugin::agvName
private

Name of the AGV.

Definition at line 52 of file ROSAGVPlugin.hh.

gazebo::common::PoseAnimationPtr gazebo::ROSAGVPlugin::anim
private

Robot animation.

Definition at line 67 of file ROSAGVPlugin.hh.

gazebo::physics::ModelPtr gazebo::ROSAGVPlugin::model
private

Pointer to the model.

Definition at line 70 of file ROSAGVPlugin.hh.

std::string gazebo::ROSAGVPlugin::robotNamespace
private

for setting ROS name space

Definition at line 55 of file ROSAGVPlugin.hh.

ros::NodeHandle* gazebo::ROSAGVPlugin::rosnode
private

ros node handle

Definition at line 58 of file ROSAGVPlugin.hh.

ros::ServiceServer gazebo::ROSAGVPlugin::rosService
private

Receives service calls for controlling the AGV.

Definition at line 61 of file ROSAGVPlugin.hh.

ros::ServiceClient gazebo::ROSAGVPlugin::rosSubmitTrayClient
private

Client for submitting trays for inspection.

Definition at line 64 of file ROSAGVPlugin.hh.


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


osrf_gear
Author(s):
autogenerated on Wed Sep 7 2016 03:48:13