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

#include <GazeboInterface.h>

List of all members.

Public Member Functions

 GazeboInterface ()
virtual void Init ()
virtual void Load (physics::ModelPtr _model, sdf::ElementPtr _sdf)
void update ()
 ~GazeboInterface ()

Private Member Functions

void commandJoints (const sensor_msgs::JointState::ConstPtr &msg)
void controlJoints (const nasa_r2_common_msgs::JointControl::ConstPtr &msg)
bool getDoubleVal (XmlRpc::XmlRpcValue &val, double &doubleVal)
void traverseParams (XmlRpc::XmlRpcValue param, std::map< std::string, XmlRpc::XmlRpcValue > &valMap, std::string searchKey="", std::string ns="", std::string name="")

Private Attributes

bool advancedMode
ros::Publisher jointCapabilitiesPub
std::string jointCapabilitiesTopic
std::map< std::string,
RobotController::JointState
jointCommandRefs
ros::Publisher jointCommandRefsPub
std::string jointCommandRefsTopic
ros::Subscriber jointCommandsSub
std::string jointCommandsTopic
ros::Subscriber jointControlSub
std::string jointControlTopic
std::map< std::string,
std::pair< double, double > > 
jointLimits
ros::Publisher jointStatePub
std::map< std::string,
RobotController::JointState
jointStates
double jointStatesStepTime
std::string jointStatesTopic
ros::Publisher jointStatusPub
double jointStatusStepTime
std::string jointStatusTopic
physics::ModelPtr modelPtr
std::auto_ptr< ros::NodeHandleparamsNodePtr
common::Time prevStatesUpdateTime
common::Time prevStatusUpdateTime
std::auto_ptr< RobotControllerrobotControllerPtr
std::auto_ptr< ros::NodeHandlerosNodePtr
event::ConnectionPtr updateConnectionPtr

Detailed Description

Definition at line 18 of file GazeboInterface.h.


Constructor & Destructor Documentation

Definition at line 10 of file GazeboInterface.cpp.

Definition at line 16 of file GazeboInterface.cpp.


Member Function Documentation

void GazeboInterface::commandJoints ( const sensor_msgs::JointState::ConstPtr &  msg) [private]

Definition at line 535 of file GazeboInterface.cpp.

Definition at line 560 of file GazeboInterface.cpp.

bool GazeboInterface::getDoubleVal ( XmlRpc::XmlRpcValue val,
double &  doubleVal 
) [private]

Definition at line 178 of file GazeboInterface.cpp.

void GazeboInterface::Init ( ) [virtual]

Definition at line 196 of file GazeboInterface.cpp.

void GazeboInterface::Load ( physics::ModelPtr  _model,
sdf::ElementPtr  _sdf 
) [virtual]

Definition at line 22 of file GazeboInterface.cpp.

void GazeboInterface::traverseParams ( XmlRpc::XmlRpcValue  param,
std::map< std::string, XmlRpc::XmlRpcValue > &  valMap,
std::string  searchKey = "",
std::string  ns = "",
std::string  name = "" 
) [private]

Definition at line 143 of file GazeboInterface.cpp.

void GazeboInterface::update ( void  )

Definition at line 437 of file GazeboInterface.cpp.


Member Data Documentation

Definition at line 83 of file GazeboInterface.h.

Definition at line 68 of file GazeboInterface.h.

Definition at line 67 of file GazeboInterface.h.

Definition at line 80 of file GazeboInterface.h.

Definition at line 79 of file GazeboInterface.h.

Definition at line 78 of file GazeboInterface.h.

Definition at line 64 of file GazeboInterface.h.

Definition at line 63 of file GazeboInterface.h.

Definition at line 85 of file GazeboInterface.h.

Definition at line 84 of file GazeboInterface.h.

std::map<std::string, std::pair<double, double> > gazebo::GazeboInterface::jointLimits [private]

Definition at line 69 of file GazeboInterface.h.

Definition at line 73 of file GazeboInterface.h.

Definition at line 75 of file GazeboInterface.h.

Definition at line 74 of file GazeboInterface.h.

Definition at line 72 of file GazeboInterface.h.

Definition at line 87 of file GazeboInterface.h.

Definition at line 88 of file GazeboInterface.h.

Definition at line 86 of file GazeboInterface.h.

physics::ModelPtr gazebo::GazeboInterface::modelPtr [private]

Definition at line 51 of file GazeboInterface.h.

Definition at line 60 of file GazeboInterface.h.

Definition at line 90 of file GazeboInterface.h.

Definition at line 91 of file GazeboInterface.h.

Definition at line 56 of file GazeboInterface.h.

Definition at line 59 of file GazeboInterface.h.

Definition at line 54 of file GazeboInterface.h.


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


gazebo_interface
Author(s): rctaylo2
autogenerated on Mon Oct 6 2014 02:44:38