#include <gazebo/common/Plugin.hh>
#include <ros/callback_queue.h>
#include <ros/ros.h>
#include <hector_uav_msgs/Supply.h>
#include <hector_uav_msgs/MotorStatus.h>
#include <hector_uav_msgs/MotorPWM.h>
#include <geometry_msgs/Wrench.h>
#include <boost/thread.hpp>
#include <boost/thread/mutex.hpp>
#include <boost/thread/condition.hpp>
#include <queue>
#include <hector_gazebo_plugins/update_timer.h>
Go to the source code of this file.
Classes | |
class | gazebo::GazeboQuadrotorPropulsion |
Namespaces | |
namespace | gazebo |