Classes | |
| struct | EigenOdometry |
| class | LeePositionController |
| class | LeePositionControllerNode |
| class | LeePositionControllerParameters |
| class | RollPitchYawrateThrustController |
| class | RollPitchYawrateThrustControllerNode |
| class | RollPitchYawrateThrustControllerParameters |
| struct | Rotor |
| struct | RotorConfiguration |
| class | VehicleParameters |
Functions | |
| void | calculateAllocationMatrix (const RotorConfiguration &rotor_configuration, Eigen::Matrix4Xd *allocation_matrix) |
| void | eigenOdometryFromMsg (const nav_msgs::OdometryConstPtr &msg, EigenOdometry *odometry) |
| template<typename T > | |
| void | GetRosParameter (const ros::NodeHandle &nh, const std::string &key, const T &default_value, T *value) |
| void | GetRotorConfiguration (const ros::NodeHandle &nh, RotorConfiguration *rotor_configuration) |
| void | GetVehicleParameters (const ros::NodeHandle &nh, VehicleParameters *vehicle_parameters) |
| void | skewMatrixFromVector (Eigen::Vector3d &vector, Eigen::Matrix3d *skew_matrix) |
| void | vectorFromSkewMatrix (Eigen::Matrix3d &skew_matrix, Eigen::Vector3d *vector) |
Variables | |
| static const Eigen::Vector3d | kDefaultAngularRateGain = Eigen::Vector3d(0.52, 0.52, 0.025) |
| static const Eigen::Vector3d | kDefaultAngularRateGain = Eigen::Vector3d(0.52, 0.52, 0.025) |
| static constexpr double | kDefaultArmLength = 0.215 |
| static const Eigen::Vector3d | kDefaultAttitudeGain = Eigen::Vector3d(3, 3, 0.035) |
| static const Eigen::Vector3d | kDefaultAttitudeGain = Eigen::Vector3d(3, 3, 0.035) |
| static const std::string | kDefaultCommandMotorSpeedTopic |
| static const std::string | kDefaultCommandMultiDofJointTrajectoryTopic |
| static const std::string | kDefaultCommandRollPitchYawrateThrustTopic |
| static constexpr double | kDefaultGravity = 9.81 |
| static const std::string | kDefaultImuTopic |
| static constexpr double | kDefaultInertiaXx = 0.0347563 |
| static constexpr double | kDefaultInertiaYy = 0.0458929 |
| static constexpr double | kDefaultInertiaZz = 0.0977 |
| static constexpr double | kDefaultMass = 1.56779 |
| static const std::string | kDefaultNamespace = "" |
| static const std::string | kDefaultOdometryTopic |
| static const Eigen::Vector3d | kDefaultPositionGain = Eigen::Vector3d(6, 6, 6) |
| static constexpr double | kDefaultRotor0Angle = 0.52359877559 |
| static constexpr double | kDefaultRotor1Angle = 1.57079632679 |
| static constexpr double | kDefaultRotor2Angle = 2.61799387799 |
| static constexpr double | kDefaultRotor3Angle = -2.61799387799 |
| static constexpr double | kDefaultRotor4Angle = -1.57079632679 |
| static constexpr double | kDefaultRotor5Angle = -0.52359877559 |
| static constexpr double | kDefaultRotorForceConstant = 8.54858e-6 |
| static constexpr double | kDefaultRotorMomentConstant = 1.6e-2 |
| static const Eigen::Vector3d | kDefaultVelocityGain = Eigen::Vector3d(4.7, 4.7, 4.7) |
|
inline |
|
inline |
|
inline |
Definition at line 10 of file parameters_ros.h.
|
inline |
Definition at line 23 of file parameters_ros.h.
|
inline |
Definition at line 48 of file parameters_ros.h.
|
inline |
|
inline |
|
static |
Definition at line 34 of file roll_pitch_yawrate_thrust_controller.h.
|
static |
Definition at line 36 of file lee_position_controller.h.
|
static |
Definition at line 15 of file parameters.h.
|
static |
Definition at line 33 of file roll_pitch_yawrate_thrust_controller.h.
|
static |
Definition at line 35 of file lee_position_controller.h.
|
static |
|
static |
|
static |
|
static |
Definition at line 23 of file parameters.h.
|
static |
|
static |
Definition at line 16 of file parameters.h.
|
static |
Definition at line 17 of file parameters.h.
|
static |
Definition at line 18 of file parameters.h.
|
static |
Definition at line 14 of file parameters.h.
|
static |
|
static |
|
static |
Definition at line 33 of file lee_position_controller.h.
|
static |
Definition at line 6 of file parameters.h.
|
static |
Definition at line 7 of file parameters.h.
|
static |
Definition at line 8 of file parameters.h.
|
static |
Definition at line 9 of file parameters.h.
|
static |
Definition at line 10 of file parameters.h.
|
static |
Definition at line 11 of file parameters.h.
|
static |
Definition at line 19 of file parameters.h.
|
static |
Definition at line 20 of file parameters.h.
|
static |
Definition at line 34 of file lee_position_controller.h.