#include <ros/ros.h>
#include <std_msgs/String.h>
#include <light_buoy_colors.pb.h>
#include <dock_placard.pb.h>
#include <memory>
#include <string>
#include <vector>
#include <gazebo/gazebo.hh>
#include <sdf/sdf.hh>
#include "vrx_gazebo/ColorSequence.h"
#include "vrx_gazebo/scoring_plugin.hh"
Go to the source code of this file.
Classes | |
class | ColorSequenceChecker |
A class to monitor if the color sequence reported matches the color displayed in the light buoy. More... | |
class | DockChecker |
A class to monitor if the vehicle docked in a given bay. More... | |
class | ScanDockScoringPlugin |
A plugin for computing the score of the scan and dock task. This plugin derives from the generic ScoringPlugin class. Check out that plugin for other required SDF elements. This plugin requires the following SDF parameters: More... | |