Public Member Functions | Private Attributes
gazebo::ROSAGVPlugin Class Reference

ROS implementation of the ConveyorBeltPlugin plugin. More...

#include <ROSAGVPlugin.hh>

List of all members.

Public Member Functions

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

Private Attributes

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

Detailed Description

ROS implementation of the ConveyorBeltPlugin plugin.

Definition at line 31 of file ROSAGVPlugin.hh.


Constructor & Destructor Documentation

Constructor.

Definition at line 29 of file ROSAGVPlugin.cc.

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

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.

for setting ROS name space

Definition at line 55 of file ROSAGVPlugin.hh.

ros node handle

Definition at line 58 of file ROSAGVPlugin.hh.

Receives service calls for controlling the AGV.

Definition at line 61 of file ROSAGVPlugin.hh.

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 Mon Sep 5 2016 03:41:33