#include <gazebo_ros_api_plugin.h>
Definition at line 125 of file gazebo_ros_api_plugin.h.
Definition at line 34 of file gazebo_ros_api_plugin.cpp.
Definition at line 40 of file gazebo_ros_api_plugin.cpp.
advertise services
Definition at line 166 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::applyBodyWrench | ( | gazebo_msgs::ApplyBodyWrench::Request & | req, |
gazebo_msgs::ApplyBodyWrench::Response & | res | ||
) |
shift wrench to body frame if a non-zero reference point is given
Definition at line 1415 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::applyJointEffort | ( | gazebo_msgs::ApplyJointEffort::Request & | req, |
gazebo_msgs::ApplyJointEffort::Response & | res | ||
) |
Definition at line 1149 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::clearBodyWrenches | ( | gazebo_msgs::BodyRequest::Request & | req, |
gazebo_msgs::BodyRequest::Response & | res | ||
) |
Definition at line 1242 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::clearBodyWrenches | ( | std::string | body_name | ) |
Definition at line 1246 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::clearJointForces | ( | gazebo_msgs::JointRequest::Request & | req, |
gazebo_msgs::JointRequest::Response & | res | ||
) |
Definition at line 1213 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::clearJointForces | ( | std::string | joint_name | ) |
Definition at line 1217 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::deleteModel | ( | gazebo_msgs::DeleteModel::Request & | req, |
gazebo_msgs::DeleteModel::Response & | res | ||
) |
delete model given name
Definition at line 577 of file gazebo_ros_api_plugin.cpp.
void gazebo::GazeboRosApiPlugin::forceJointSchedulerSlot | ( | ) | [private] |
Definition at line 1608 of file gazebo_ros_api_plugin.cpp.
ros queue thread for this node
Definition at line 157 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::getJointProperties | ( | gazebo_msgs::GetJointProperties::Request & | req, |
gazebo_msgs::GetJointProperties::Response & | res | ||
) |
Definition at line 794 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::getLinkProperties | ( | gazebo_msgs::GetLinkProperties::Request & | req, |
gazebo_msgs::GetLinkProperties::Response & | res | ||
) |
Definition at line 831 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::getLinkState | ( | gazebo_msgs::GetLinkState::Request & | req, |
gazebo_msgs::GetLinkState::Response & | res | ||
) |
Definition at line 872 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::getModelProperties | ( | gazebo_msgs::GetModelProperties::Request & | req, |
gazebo_msgs::GetModelProperties::Response & | res | ||
) |
Definition at line 716 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::getModelState | ( | gazebo_msgs::GetModelState::Request & | req, |
gazebo_msgs::GetModelState::Response & | res | ||
) |
Definition at line 642 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::getPhysicsProperties | ( | gazebo_msgs::GetPhysicsProperties::Request & | req, |
gazebo_msgs::GetPhysicsProperties::Response & | res | ||
) |
Definition at line 998 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::getWorldProperties | ( | gazebo_msgs::GetWorldProperties::Request & | req, |
gazebo_msgs::GetWorldProperties::Response & | res | ||
) |
Definition at line 779 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::IsGazeboModelXML | ( | std::string | model_xml | ) | [private] |
Definition at line 1548 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::IsSDF | ( | std::string | model_xml | ) | [private] |
Definition at line 1558 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::IsURDF | ( | std::string | model_xml | ) | [private] |
utilites for checking incoming string URDF/XML/Param
Definition at line 1539 of file gazebo_ros_api_plugin.cpp.
void gazebo::GazeboRosApiPlugin::Load | ( | int | argc, |
char ** | argv | ||
) |
setup custom callback queue
start a thread for the physics dynamic reconfigure node
Definition at line 81 of file gazebo_ros_api_plugin.cpp.
void gazebo::GazeboRosApiPlugin::LoadGazeboRosApiPlugin | ( | std::string | _worldName | ) | [private] |
advertise all services
Definition at line 102 of file gazebo_ros_api_plugin.cpp.
Definition at line 373 of file gazebo_ros_api_plugin.cpp.
Definition at line 385 of file gazebo_ros_api_plugin.cpp.
Definition at line 379 of file gazebo_ros_api_plugin.cpp.
Definition at line 395 of file gazebo_ros_api_plugin.cpp.
void gazebo::GazeboRosApiPlugin::OnResponse | ( | ConstResponsePtr & | _response | ) | [private] |
Definition at line 151 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::pausePhysics | ( | std_srvs::Empty::Request & | req, |
std_srvs::Empty::Response & | res | ||
) |
Definition at line 1197 of file gazebo_ros_api_plugin.cpp.
void gazebo::GazeboRosApiPlugin::PhysicsReconfigureCallback | ( | gazebo::PhysicsConfig & | config, |
uint32_t | level | ||
) | [private] |
Definition at line 1743 of file gazebo_ros_api_plugin.cpp.
void gazebo::GazeboRosApiPlugin::PhysicsReconfigureNode | ( | ) | [private] |
Definition at line 1816 of file gazebo_ros_api_plugin.cpp.
void gazebo::GazeboRosApiPlugin::publishLinkStates | ( | ) | [private] |
Definition at line 1661 of file gazebo_ros_api_plugin.cpp.
void gazebo::GazeboRosApiPlugin::publishModelStates | ( | ) | [private] |
Definition at line 1708 of file gazebo_ros_api_plugin.cpp.
void gazebo::GazeboRosApiPlugin::publishSimTime | ( | const boost::shared_ptr< gazebo::msgs::WorldStatistics const > & | msg | ) | [private] |
Definition at line 1640 of file gazebo_ros_api_plugin.cpp.
void gazebo::GazeboRosApiPlugin::publishSimTime | ( | ) | [private] |
Definition at line 1649 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::resetSimulation | ( | std_srvs::Empty::Request & | req, |
std_srvs::Empty::Response & | res | ||
) |
Definition at line 1181 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::resetWorld | ( | std_srvs::Empty::Request & | req, |
std_srvs::Empty::Response & | res | ||
) |
Definition at line 1189 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::setJointProperties | ( | gazebo_msgs::SetJointProperties::Request & | req, |
gazebo_msgs::SetJointProperties::Response & | res | ||
) |
Definition at line 1027 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::setLinkProperties | ( | gazebo_msgs::SetLinkProperties::Request & | req, |
gazebo_msgs::SetLinkProperties::Response & | res | ||
) |
Definition at line 939 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::setLinkState | ( | gazebo_msgs::SetLinkState::Request & | req, |
gazebo_msgs::SetLinkState::Response & | res | ||
) |
Definition at line 1319 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::setModelConfiguration | ( | gazebo_msgs::SetModelConfiguration::Request & | req, |
gazebo_msgs::SetModelConfiguration::Response & | res | ||
) |
Definition at line 1274 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::setModelState | ( | gazebo_msgs::SetModelState::Request & | req, |
gazebo_msgs::SetModelState::Response & | res | ||
) |
Definition at line 1074 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::setPhysicsProperties | ( | gazebo_msgs::SetPhysicsProperties::Request & | req, |
gazebo_msgs::SetPhysicsProperties::Response & | res | ||
) |
Definition at line 966 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::spawnAndConform | ( | TiXmlDocument & | gazebo_model_xml, |
std::string | model_name, | ||
gazebo_msgs::SpawnModel::Response & | res | ||
) | [private] |
FIXME: should change publish to direct invocation World::LoadModel() and/or change the poll for Model existence to common::Events based check.
poll and wait, verify that the model is spawned within Hardcoded 60 seconds
Definition at line 2068 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::spawnGazeboModel | ( | gazebo_msgs::SpawnModel::Request & | req, |
gazebo_msgs::SpawnModel::Response & | res | ||
) |
Definition at line 475 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::spawnURDFModel | ( | gazebo_msgs::SpawnModel::Request & | req, |
gazebo_msgs::SpawnModel::Response & | res | ||
) |
STRIP DECLARATION <? ... xml version="1.0" ... ?> from model_xml
Definition at line 406 of file gazebo_ros_api_plugin.cpp.
void gazebo::GazeboRosApiPlugin::spin | ( | ) |
Definition at line 1527 of file gazebo_ros_api_plugin.cpp.
void gazebo::GazeboRosApiPlugin::stripXmlDeclaration | ( | std::string & | model_xml | ) | [private] |
STRIP DECLARATION <? ... xml version="1.0" ... ?> from model_xml
Definition at line 1843 of file gazebo_ros_api_plugin.cpp.
void gazebo::GazeboRosApiPlugin::transformWrench | ( | gazebo::math::Vector3 & | target_force, |
gazebo::math::Vector3 & | target_torque, | ||
gazebo::math::Vector3 | reference_force, | ||
gazebo::math::Vector3 | reference_torque, | ||
gazebo::math::Pose | target_to_reference | ||
) | [private] |
shift wrench from reference frame to target frame assume wrench is defined in
Definition at line 1399 of file gazebo_ros_api_plugin.cpp.
bool gazebo::GazeboRosApiPlugin::unpausePhysics | ( | std_srvs::Empty::Request & | req, |
std_srvs::Empty::Response & | res | ||
) |
Definition at line 1205 of file gazebo_ros_api_plugin.cpp.
void gazebo::GazeboRosApiPlugin::updateGazeboSDFModelPose | ( | TiXmlDocument & | gazebo_model_xml, |
gazebo::math::Vector3 | initial_xyz, | ||
gazebo::math::Quaternion | initial_q | ||
) | [private] |
Definition at line 1917 of file gazebo_ros_api_plugin.cpp.
void gazebo::GazeboRosApiPlugin::updateGazeboSDFName | ( | TiXmlDocument & | gazebo_model_xml, |
std::string | model_name | ||
) | [private] |
Definition at line 1951 of file gazebo_ros_api_plugin.cpp.
void gazebo::GazeboRosApiPlugin::updateGazeboXmlModelPose | ( | TiXmlDocument & | gazebo_model_xml, |
gazebo::math::Vector3 | initial_xyz, | ||
gazebo::math::Quaternion | initial_q | ||
) | [private] |
Definition at line 1859 of file gazebo_ros_api_plugin.cpp.
void gazebo::GazeboRosApiPlugin::updateGazeboXmlName | ( | TiXmlDocument & | gazebo_model_xml, |
std::string | model_name | ||
) | [private] |
Definition at line 1897 of file gazebo_ros_api_plugin.cpp.
void gazebo::GazeboRosApiPlugin::updateLinkState | ( | const gazebo_msgs::LinkState::ConstPtr & | link_state | ) |
Definition at line 1387 of file gazebo_ros_api_plugin.cpp.
void gazebo::GazeboRosApiPlugin::updateModelState | ( | const gazebo_msgs::ModelState::ConstPtr & | model_state | ) |
Definition at line 1139 of file gazebo_ros_api_plugin.cpp.
void gazebo::GazeboRosApiPlugin::updateURDFModelPose | ( | TiXmlDocument & | gazebo_model_xml, |
gazebo::math::Vector3 | initial_xyz, | ||
gazebo::math::Quaternion | initial_q | ||
) | [private] |
Definition at line 1976 of file gazebo_ros_api_plugin.cpp.
void gazebo::GazeboRosApiPlugin::updateURDFName | ( | TiXmlDocument & | gazebo_model_xml, |
std::string | model_name | ||
) | [private] |
Definition at line 2012 of file gazebo_ros_api_plugin.cpp.
void gazebo::GazeboRosApiPlugin::walkChildAddRobotNamespace | ( | TiXmlNode * | robot_xml | ) | [private] |
Definition at line 2032 of file gazebo_ros_api_plugin.cpp.
void gazebo::GazeboRosApiPlugin::wrenchBodySchedulerSlot | ( | ) | [private] |
Definition at line 1572 of file gazebo_ros_api_plugin.cpp.
Definition at line 282 of file gazebo_ros_api_plugin.h.
Definition at line 285 of file gazebo_ros_api_plugin.h.
Definition at line 293 of file gazebo_ros_api_plugin.h.
Definition at line 292 of file gazebo_ros_api_plugin.h.
Definition at line 272 of file gazebo_ros_api_plugin.h.
gazebo::transport::PublisherPtr gazebo::GazeboRosApiPlugin::factory_pub_ [private] |
Definition at line 254 of file gazebo_ros_api_plugin.h.
std::vector<GazeboRosApiPlugin::ForceJointJob*> gazebo::GazeboRosApiPlugin::force_joint_jobs [private] |
Definition at line 348 of file gazebo_ros_api_plugin.h.
Definition at line 264 of file gazebo_ros_api_plugin.h.
boost::thread* gazebo::GazeboRosApiPlugin::gazebo_callback_queue_thread_ [private] |
Definition at line 260 of file gazebo_ros_api_plugin.h.
Definition at line 259 of file gazebo_ros_api_plugin.h.
gazebo::transport::NodePtr gazebo::GazeboRosApiPlugin::gazebonode_ [private] |
Definition at line 252 of file gazebo_ros_api_plugin.h.
Definition at line 276 of file gazebo_ros_api_plugin.h.
Definition at line 277 of file gazebo_ros_api_plugin.h.
Definition at line 278 of file gazebo_ros_api_plugin.h.
Definition at line 274 of file gazebo_ros_api_plugin.h.
Definition at line 273 of file gazebo_ros_api_plugin.h.
Definition at line 281 of file gazebo_ros_api_plugin.h.
Definition at line 275 of file gazebo_ros_api_plugin.h.
gazebo::event::ConnectionPtr gazebo::GazeboRosApiPlugin::load_gazebo_ros_api_plugin_event_ [private] |
Definition at line 268 of file gazebo_ros_api_plugin.h.
boost::mutex gazebo::GazeboRosApiPlugin::lock_ [private] |
A mutex to lock access to fields that are used in ROS message callbacks.
Definition at line 319 of file gazebo_ros_api_plugin.h.
Definition at line 290 of file gazebo_ros_api_plugin.h.
Definition at line 310 of file gazebo_ros_api_plugin.h.
bool gazebo::GazeboRosApiPlugin::physics_reconfigure_initialized_ [private] |
Definition at line 308 of file gazebo_ros_api_plugin.h.
Definition at line 309 of file gazebo_ros_api_plugin.h.
boost::thread* gazebo::GazeboRosApiPlugin::physics_reconfigure_thread_ [private] |
Definition at line 307 of file gazebo_ros_api_plugin.h.
Definition at line 316 of file gazebo_ros_api_plugin.h.
Definition at line 296 of file gazebo_ros_api_plugin.h.
Definition at line 298 of file gazebo_ros_api_plugin.h.
Definition at line 266 of file gazebo_ros_api_plugin.h.
Definition at line 297 of file gazebo_ros_api_plugin.h.
Definition at line 299 of file gazebo_ros_api_plugin.h.
Definition at line 267 of file gazebo_ros_api_plugin.h.
gazebo::transport::PublisherPtr gazebo::GazeboRosApiPlugin::request_pub_ [private] |
Definition at line 255 of file gazebo_ros_api_plugin.h.
Definition at line 288 of file gazebo_ros_api_plugin.h.
Definition at line 289 of file gazebo_ros_api_plugin.h.
gazebo::transport::SubscriberPtr gazebo::GazeboRosApiPlugin::response_sub_ [private] |
Definition at line 256 of file gazebo_ros_api_plugin.h.
std::string gazebo::GazeboRosApiPlugin::robot_namespace_ [private] |
Definition at line 403 of file gazebo_ros_api_plugin.h.
boost::thread* gazebo::GazeboRosApiPlugin::ros_spin_thread_ [private] |
Definition at line 306 of file gazebo_ros_api_plugin.h.
Definition at line 258 of file gazebo_ros_api_plugin.h.
Definition at line 283 of file gazebo_ros_api_plugin.h.
Definition at line 279 of file gazebo_ros_api_plugin.h.
Definition at line 287 of file gazebo_ros_api_plugin.h.
Definition at line 294 of file gazebo_ros_api_plugin.h.
Definition at line 286 of file gazebo_ros_api_plugin.h.
Definition at line 284 of file gazebo_ros_api_plugin.h.
Definition at line 295 of file gazebo_ros_api_plugin.h.
Definition at line 280 of file gazebo_ros_api_plugin.h.
Definition at line 270 of file gazebo_ros_api_plugin.h.
Definition at line 271 of file gazebo_ros_api_plugin.h.
gazebo::transport::SubscriberPtr gazebo::GazeboRosApiPlugin::stat_sub_ [private] |
Definition at line 253 of file gazebo_ros_api_plugin.h.
Definition at line 265 of file gazebo_ros_api_plugin.h.
Definition at line 291 of file gazebo_ros_api_plugin.h.
gazebo::physics::WorldPtr gazebo::GazeboRosApiPlugin::world [private] |
Definition at line 262 of file gazebo_ros_api_plugin.h.
bool gazebo::GazeboRosApiPlugin::world_created_ [private] |
Definition at line 326 of file gazebo_ros_api_plugin.h.
std::vector<GazeboRosApiPlugin::WrenchBodyJob*> gazebo::GazeboRosApiPlugin::wrench_body_jobs [private] |
Definition at line 347 of file gazebo_ros_api_plugin.h.
Definition at line 263 of file gazebo_ros_api_plugin.h.
std::string gazebo::GazeboRosApiPlugin::xmlPrefix_ [private] |
Definition at line 302 of file gazebo_ros_api_plugin.h.
std::string gazebo::GazeboRosApiPlugin::xmlSuffix_ [private] |
Definition at line 303 of file gazebo_ros_api_plugin.h.