#include <GazeboInterface.h>
Definition at line 16 of file GazeboInterface.h.
Definition at line 10 of file GazeboInterface.cpp.
Definition at line 16 of file GazeboInterface.cpp.
void GazeboInterface::commandJoints | ( | const sensor_msgs::JointState::ConstPtr & | msg | ) | [private] |
Definition at line 467 of file GazeboInterface.cpp.
void GazeboInterface::controlJoints | ( | const r2_msgs::JointControl::ConstPtr & | msg | ) | [private] |
Definition at line 492 of file GazeboInterface.cpp.
bool GazeboInterface::getDoubleVal | ( | XmlRpc::XmlRpcValue & | val, |
double & | doubleVal | ||
) | [private] |
Definition at line 162 of file GazeboInterface.cpp.
void GazeboInterface::Init | ( | void | ) | [virtual] |
Definition at line 180 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 127 of file GazeboInterface.cpp.
void GazeboInterface::update | ( | void | ) |
Definition at line 415 of file GazeboInterface.cpp.
bool gazebo::GazeboInterface::advancedMode [private] |
Definition at line 70 of file GazeboInterface.h.
Definition at line 62 of file GazeboInterface.h.
std::string gazebo::GazeboInterface::jointCommandsTopic [private] |
Definition at line 61 of file GazeboInterface.h.
Definition at line 72 of file GazeboInterface.h.
std::string gazebo::GazeboInterface::jointControlTopic [private] |
Definition at line 71 of file GazeboInterface.h.
Definition at line 66 of file GazeboInterface.h.
double gazebo::GazeboInterface::jointStatesStepTime [private] |
Definition at line 67 of file GazeboInterface.h.
std::string gazebo::GazeboInterface::jointStatesTopic [private] |
Definition at line 65 of file GazeboInterface.h.
Definition at line 74 of file GazeboInterface.h.
double gazebo::GazeboInterface::jointStatusStepTime [private] |
Definition at line 75 of file GazeboInterface.h.
std::string gazebo::GazeboInterface::jointStatusTopic [private] |
Definition at line 73 of file GazeboInterface.h.
physics::ModelPtr gazebo::GazeboInterface::modelPtr [private] |
Definition at line 49 of file GazeboInterface.h.
std::auto_ptr<ros::NodeHandle> gazebo::GazeboInterface::paramsNodePtr [private] |
Definition at line 58 of file GazeboInterface.h.
common::Time gazebo::GazeboInterface::prevStatesUpdateTime [private] |
Definition at line 77 of file GazeboInterface.h.
common::Time gazebo::GazeboInterface::prevStatusUpdateTime [private] |
Definition at line 78 of file GazeboInterface.h.
std::auto_ptr<RobotController> gazebo::GazeboInterface::robotControllerPtr [private] |
Definition at line 54 of file GazeboInterface.h.
std::auto_ptr<ros::NodeHandle> gazebo::GazeboInterface::rosNodePtr [private] |
Definition at line 57 of file GazeboInterface.h.
Definition at line 52 of file GazeboInterface.h.