18 #ifndef VRX_GAZEBO_WAYFINDING_SCORING_PLUGIN_HH_ 19 #define VRX_GAZEBO_WAYFINDING_SCORING_PLUGIN_HH_ 25 #include <gazebo/common/Events.hh> 26 #include <gazebo/common/Timer.hh> 27 #include <gazebo/physics/World.hh> 64 public:
void Load(gazebo::physics::WorldPtr _world,
65 sdf::ElementPtr _sdf);
71 private:
void OnReady()
override;
83 private: sdf::ElementPtr
sdf;
96 private: std::unique_ptr<ros::NodeHandle>
rosNode;
124 private: gazebo::common::Timer
timer;
gazebo::event::ConnectionPtr updateConnection
Pointer to the update event connection.
double meanError
Current average minimum error for all waypoints.
void PublishWaypoints()
Publish the waypoints through which the vehicle must navigate.
std::vector< double > minErrors
Vector containing current minimum 2D pose error achieved for each waypoint so far.
void OnReady() override
Callback executed when the task state transition into "ready".
ros::Publisher meanErrorPub
Publisher for the current rms error.
std::unique_ptr< ros::NodeHandle > rosNode
ROS node handle.
std::string minErrorsTopic
Topic where the current minimum pose error distance for each waypoint is published.
void Load(gazebo::physics::WorldPtr _world, sdf::ElementPtr _sdf)
ros::Publisher waypointsPub
Publisher for the goal.
std::string waypointsTopic
Topic where the list of waypoints is published.
void Update()
Callback executed at every world update.
ros::Publisher minErrorsPub
Publisher for the combined 2D pose error.
std::vector< ignition::math::Vector3d > localWaypoints
Vector containing waypoints as 3D vectors of doubles representing X Y yaw, where X and Y are local (G...
A plugin that provides common functionality to any scoring plugin. This plugin defines four different...
std::vector< ignition::math::Vector3d > sphericalWaypoints
Vector containing waypoints as 3D vectors of doubles representing Lattitude Longitude yaw...
This class is used to display waypoint markers. Cylindrical Gazebo markers are drawn with text on top...
sdf::ElementPtr sdf
Pointer to the sdf plugin element.
WayfindingScoringPlugin()
Constructor.
WaypointMarkers waypointMarkers
Waypoint visualization markers.
std::string meanErrorTopic
Topic where the current average minimum error is published.
gazebo::common::Timer timer
Timer used to calculate the elapsed time docked in the bay.
A plugin for computing the score of the wayfinding navigation task. This plugin derives from the gene...
void OnRunning() override
Callback executed when the task state transition into "running".