#include <ros/ros.h>
#include <std_msgs/ColorRGBA.h>
#include <std_msgs/Empty.h>
#include <dock_placard.pb.h>
#include <array>
#include <cstdint>
#include <map>
#include <mutex>
#include <string>
#include <vector>
#include <gazebo/gazebo.hh>
#include <sdf/sdf.hh>
Go to the source code of this file.
Classes | |
class | PlacardPlugin |
Controls the shape and color of a symbol. More... | |
Namespaces | |
gazebo | |
Typedefs | |
typedef const boost::shared_ptr< const dock_placard_msgs::msgs::DockPlacard > | gazebo::ConstDockPlacardPtr |