29 #ifndef HECTOR_QUADROTOR_MODEL_QUADROTOR_AERODYNAMICS_H 30 #define HECTOR_QUADROTOR_MODEL_QUADROTOR_AERODYNAMICS_H 32 #include <geometry_msgs/Quaternion.h> 33 #include <geometry_msgs/Twist.h> 34 #include <geometry_msgs/Vector3.h> 35 #include <geometry_msgs/Wrench.h> 39 #include <boost/thread/mutex.hpp> 54 void setTwist(
const geometry_msgs::Twist& twist);
56 void setWind(
const geometry_msgs::Vector3& wind);
60 void f(
const double uin[6],
double dt,
double y[6])
const;
77 #endif // HECTOR_QUADROTOR_MODEL_QUADROTOR_AERODYNAMICS_H
bool param(const std::string ¶m_name, T ¶m_val, const T &default_val)
geometry_msgs::Wrench wrench_
void setWind(const geometry_msgs::Vector3 &wind)
void f(const double uin[6], double dt, double y[6]) const
const geometry_msgs::Wrench & getWrench() const
geometry_msgs::Twist twist_
void setOrientation(const geometry_msgs::Quaternion &orientation)
void setTwist(const geometry_msgs::Twist &twist)
bool configure(const ros::NodeHandle ¶m=ros::NodeHandle("~"))
void setBodyTwist(const geometry_msgs::Twist &twist)
geometry_msgs::Quaternion orientation_
geometry_msgs::Vector3 wind_