32 #ifndef ROSFLIGHT_SIM_MULTIROTOR_FORCES_AND_MOMENTS_H 33 #define ROSFLIGHT_SIM_MULTIROTOR_FORCES_AND_MOMENTS_H 36 #include <eigen3/Eigen/Dense> 110 void set_wind(Eigen::Vector3d wind);
115 #endif // ROSFLIGHT_SIM_MULTIROTOR_FORCES_AND_MOMENTS_H Eigen::Matrix< double, 6, 1 > updateForcesAndTorques(Current_State x, const int act_cmds[])
Eigen::VectorXd rotor_rotation_direction_
Eigen::VectorXd desired_forces_
Eigen::VectorXd actual_torques_
Eigen::VectorXd actual_forces_
struct rosflight_sim::Multirotor::Actuators actuators_
Multirotor(ros::NodeHandle *nh)
std::vector< double > ground_effect_
std::vector< Motor > motors_
std::vector< double > T_poly
Eigen::MatrixXd rotor_plane_normal_
void set_wind(Eigen::Vector3d wind)
Eigen::MatrixXd force_allocation_matrix_
Eigen::MatrixXd torque_allocation_matrix_
std::vector< double > F_poly
Eigen::MatrixXd rotor_position_
Eigen::VectorXd desired_torques_