29 #ifndef SERVO_PLUGIN_H 30 #define SERVO_PLUGIN_H 32 #include <gazebo/common/Plugin.hh> 33 #include <gazebo/common/Time.hh> 34 #if (GAZEBO_MAJOR_VERSION < 8) 35 #include <gazebo/math/Quaternion.hh> 42 #include <geometry_msgs/QuaternionStamped.h> 43 #include <sensor_msgs/JointState.h> 46 #include <boost/thread.hpp> 47 #include <boost/bind.hpp> 60 virtual void Load(physics::ModelPtr _model, sdf::ElementPtr _sdf);
80 #if (GAZEBO_MAJOR_VERSION >= 8) 81 ignition::math::Vector3d
axis;
118 void cmdCallback(
const geometry_msgs::QuaternionStamped::ConstPtr& cmd_msg);
122 #if (GAZEBO_MAJOR_VERSION >= 8)
void CalculateVelocities()
common::Time prevUpdateTime
unsigned int countOfServos
event::ConnectionPtr updateConnection
ros::Publisher jointStatePub_
tf::TransformListener * transform_listener_
virtual void Load(physics::ModelPtr _model, sdf::ElementPtr _sdf)
math::Quaternion rotation_
void publish_joint_states()
float proportionalControllerGain
unsigned int orderOfAxes[3]
ros::CallbackQueue queue_
void cmdCallback(const geometry_msgs::QuaternionStamped::ConstPtr &cmd_msg)
physics::WorldPtr world
The parent World.
unsigned int rotationConv
common::Time controlPeriod
std::string jointStateName
geometry_msgs::QuaternionStamped::ConstPtr current_cmd
std::string robotNamespace
float derivativeControllerGain
ros::NodeHandle * rosnode_
struct gazebo::ServoPlugin::Servo servo[3]
sensor_msgs::JointState joint_state