in simulation_ws/src/rover/hector_gazebo_plugins/src/gazebo_ros_gps.cpp [65:176]
void GazeboRosGps::Load(physics::ModelPtr _model, sdf::ElementPtr _sdf)
{
world = _model->GetWorld();
// load parameters
if (!_sdf->HasElement("robotNamespace"))
namespace_.clear();
else
namespace_ = _sdf->GetElement("robotNamespace")->GetValue()->GetAsString();
if (!_sdf->HasElement("bodyName"))
{
link = _model->GetLink();
link_name_ = link->GetName();
}
else {
link_name_ = _sdf->GetElement("bodyName")->GetValue()->GetAsString();
link = _model->GetLink(link_name_);
}
if (!link)
{
ROS_FATAL("GazeboRosGps plugin error: bodyName: %s does not exist\n", link_name_.c_str());
return;
}
// default parameters
frame_id_ = "/world";
fix_topic_ = "fix";
velocity_topic_ = "fix_velocity";
reference_latitude_ = DEFAULT_REFERENCE_LATITUDE;
reference_longitude_ = DEFAULT_REFERENCE_LONGITUDE;
reference_heading_ = DEFAULT_REFERENCE_HEADING * M_PI/180.0;
reference_altitude_ = DEFAULT_REFERENCE_ALTITUDE;
fix_.status.status = sensor_msgs::NavSatStatus::STATUS_FIX;
fix_.status.service = 0;
if (_sdf->HasElement("frameId"))
frame_id_ = _sdf->GetElement("frameId")->GetValue()->GetAsString();
if (_sdf->HasElement("topicName"))
fix_topic_ = _sdf->GetElement("topicName")->GetValue()->GetAsString();
if (_sdf->HasElement("velocityTopicName"))
velocity_topic_ = _sdf->GetElement("velocityTopicName")->GetValue()->GetAsString();
if (_sdf->HasElement("referenceLatitude"))
_sdf->GetElement("referenceLatitude")->GetValue()->Get(reference_latitude_);
if (_sdf->HasElement("referenceLongitude"))
_sdf->GetElement("referenceLongitude")->GetValue()->Get(reference_longitude_);
if (_sdf->HasElement("referenceHeading"))
if (_sdf->GetElement("referenceHeading")->GetValue()->Get(reference_heading_))
reference_heading_ *= M_PI/180.0;
if (_sdf->HasElement("referenceAltitude"))
_sdf->GetElement("referenceAltitude")->GetValue()->Get(reference_altitude_);
if (_sdf->HasElement("status")) {
int status = fix_.status.status;
if (_sdf->GetElement("status")->GetValue()->Get(status))
fix_.status.status = static_cast<sensor_msgs::NavSatStatus::_status_type>(status);
}
if (_sdf->HasElement("service")) {
unsigned int service = fix_.status.service;
if (_sdf->GetElement("service")->GetValue()->Get(service))
fix_.status.service = static_cast<sensor_msgs::NavSatStatus::_service_type>(service);
}
fix_.header.frame_id = frame_id_;
velocity_.header.frame_id = frame_id_;
position_error_model_.Load(_sdf);
velocity_error_model_.Load(_sdf, "velocity");
// calculate earth radii
double temp = 1.0 / (1.0 - excentrity2 * sin(reference_latitude_ * M_PI/180.0) * sin(reference_latitude_ * M_PI/180.0));
double prime_vertical_radius = equatorial_radius * sqrt(temp);
radius_north_ = prime_vertical_radius * (1 - excentrity2) * temp;
radius_east_ = prime_vertical_radius * cos(reference_latitude_ * M_PI/180.0);
// Make sure the ROS node for Gazebo has already been initialized
if (!ros::isInitialized())
{
ROS_FATAL_STREAM("A ROS node for Gazebo has not been initialized, unable to load plugin. "
<< "Load the Gazebo system plugin 'libgazebo_ros_api_plugin.so' in the gazebo_ros package)");
return;
}
node_handle_ = new ros::NodeHandle(namespace_);
fix_publisher_ = node_handle_->advertise<sensor_msgs::NavSatFix>(fix_topic_, 10);
velocity_publisher_ = node_handle_->advertise<geometry_msgs::Vector3Stamped>(velocity_topic_, 10);
// setup dynamic_reconfigure servers
dynamic_reconfigure_server_position_.reset(new dynamic_reconfigure::Server<SensorModelConfig>(ros::NodeHandle(*node_handle_, fix_topic_ + "/position")));
dynamic_reconfigure_server_velocity_.reset(new dynamic_reconfigure::Server<SensorModelConfig>(ros::NodeHandle(*node_handle_, fix_topic_ + "/velocity")));
dynamic_reconfigure_server_status_.reset(new dynamic_reconfigure::Server<GNSSConfig>(ros::NodeHandle(*node_handle_, fix_topic_ + "/status")));
dynamic_reconfigure_server_position_->setCallback(boost::bind(&SensorModel3::dynamicReconfigureCallback, &position_error_model_, _1, _2));
dynamic_reconfigure_server_velocity_->setCallback(boost::bind(&SensorModel3::dynamicReconfigureCallback, &velocity_error_model_, _1, _2));
dynamic_reconfigure_server_status_->setCallback(boost::bind(&GazeboRosGps::dynamicReconfigureCallback, this, _1, _2));
Reset();
// connect Update function
updateTimer.setUpdateRate(4.0);
updateTimer.Load(world, _sdf);
updateConnection = updateTimer.Connect(boost::bind(&GazeboRosGps::Update, this));
}