Classes | |
| struct | DragParameters |
| class | PrintVector |
| struct | PropulsionParameters |
| class | QuadrotorAerodynamics |
| class | QuadrotorPropulsion |
Functions | |
| template<typename T > | |
| static void | checknan (T &value, const std::string &text="") |
| template<typename Message , typename Quaternion > | |
| static void | fromQuaternion (const Quaternion &vector, Message &msg) |
| template<typename Message , typename Vector > | |
| static void | fromVector (const Vector &vector, Message &msg) |
| template<typename T > | |
| int | isinf (const T &value) |
| template<typename T , std::size_t N> | |
| int | isinf (const boost::array< T, N > &array) |
| template<typename IteratorT > | |
| int | isinf (const boost::iterator_range< IteratorT > &range, const typename boost::iterator_range< IteratorT >::value_type &min, const typename boost::iterator_range< IteratorT >::value_type &max) |
| template<typename T > | |
| int | isnan (const T &value) |
| template<typename T , std::size_t N> | |
| int | isnan (const boost::array< T, N > &array) |
| template<typename IteratorT > | |
| int | isnan (const boost::iterator_range< IteratorT > &range, const typename boost::iterator_range< IteratorT >::value_type &min, const typename boost::iterator_range< IteratorT >::value_type &max) |
| template<typename T > | |
| void | limit (T &value, const T &min, const T &max) |
| template<typename T , std::size_t N> | |
| void | limit (boost::array< T, N > &array, const T &min, const T &max) |
| template<typename IteratorT > | |
| void | limit (const boost::iterator_range< IteratorT > &range, const typename boost::iterator_range< IteratorT >::value_type &min, const typename boost::iterator_range< IteratorT >::value_type &max) |
| static geometry_msgs::Vector3 | operator+ (const geometry_msgs::Vector3 &a, const geometry_msgs::Vector3 &b) |
| static geometry_msgs::Wrench | operator+ (const geometry_msgs::Wrench &a, const geometry_msgs::Wrench &b) |
| template<typename T > | |
| std::ostream & | operator<< (std::ostream &os, const PrintVector< T > &vector) |
| void | quadrotorDrag (const real_T uin[6], const DragParameters parameter, real_T dt, real_T y[6]) |
| void | quadrotorPropulsion (const real_T xin[4], const real_T uin[10], const PropulsionParameters parameter, real_T dt, real_T y[14], real_T xpred[4]) |
| template<typename Message , typename Quaternion > | |
| static void | toQuaternion (const Message &msg, Quaternion &vector) |
| template<typename Message , typename Vector > | |
| static void | toVector (const Message &msg, Vector &vector) |
| static void hector_quadrotor_model::checknan | ( | T & | value, |
| const std::string & | text = "" |
||
| ) | [inline, static] |
| static void hector_quadrotor_model::fromQuaternion | ( | const Quaternion & | vector, |
| Message & | msg | ||
| ) | [inline, static] |
| static void hector_quadrotor_model::fromVector | ( | const Vector & | vector, |
| Message & | msg | ||
| ) | [inline, static] |
| int hector_quadrotor_model::isinf | ( | const T & | value | ) |
| int hector_quadrotor_model::isinf | ( | const boost::array< T, N > & | array | ) |
| int hector_quadrotor_model::isinf | ( | const boost::iterator_range< IteratorT > & | range, |
| const typename boost::iterator_range< IteratorT >::value_type & | min, | ||
| const typename boost::iterator_range< IteratorT >::value_type & | max | ||
| ) |
| int hector_quadrotor_model::isnan | ( | const T & | value | ) |
| int hector_quadrotor_model::isnan | ( | const boost::array< T, N > & | array | ) |
| int hector_quadrotor_model::isnan | ( | const boost::iterator_range< IteratorT > & | range, |
| const typename boost::iterator_range< IteratorT >::value_type & | min, | ||
| const typename boost::iterator_range< IteratorT >::value_type & | max | ||
| ) |
| void hector_quadrotor_model::limit | ( | T & | value, |
| const T & | min, | ||
| const T & | max | ||
| ) |
| void hector_quadrotor_model::limit | ( | boost::array< T, N > & | array, |
| const T & | min, | ||
| const T & | max | ||
| ) |
| void hector_quadrotor_model::limit | ( | const boost::iterator_range< IteratorT > & | range, |
| const typename boost::iterator_range< IteratorT >::value_type & | min, | ||
| const typename boost::iterator_range< IteratorT >::value_type & | max | ||
| ) |
| static geometry_msgs::Vector3 hector_quadrotor_model::operator+ | ( | const geometry_msgs::Vector3 & | a, |
| const geometry_msgs::Vector3 & | b | ||
| ) | [inline, static] |
| static geometry_msgs::Wrench hector_quadrotor_model::operator+ | ( | const geometry_msgs::Wrench & | a, |
| const geometry_msgs::Wrench & | b | ||
| ) | [inline, static] |
| std::ostream& hector_quadrotor_model::operator<< | ( | std::ostream & | os, |
| const PrintVector< T > & | vector | ||
| ) |
| void hector_quadrotor_model::quadrotorDrag | ( | const real_T | uin[6], |
| const DragParameters | parameter, | ||
| real_T | dt, | ||
| real_T | y[6] | ||
| ) |
Definition at line 103 of file quadrotor_aerodynamics.cpp.
| void hector_quadrotor_model::quadrotorPropulsion | ( | const real_T | xin[4], |
| const real_T | uin[10], | ||
| const PropulsionParameters | parameter, | ||
| real_T | dt, | ||
| real_T | y[14], | ||
| real_T | xpred[4] | ||
| ) |
Definition at line 121 of file quadrotor_propulsion.cpp.
| static void hector_quadrotor_model::toQuaternion | ( | const Message & | msg, |
| Quaternion & | vector | ||
| ) | [inline, static] |
| static void hector_quadrotor_model::toVector | ( | const Message & | msg, |
| Vector & | vector | ||
| ) | [inline, static] |