27 float desiredUpdateRateHz()
override {
return 100.f; }
29 void update(
const Eigen::Quaternionf& attitude_setpoint,
30 const Eigen::Vector3f& thrust_setpoint_frd,
float yaw_sp_move_rate_rad_s = 0.f);
42 void update(
float roll,
float pitch,
float yaw,
const Eigen::Vector3f& thrust_setpoint_body,
43 float yaw_sp_move_rate_rad_s = 0.f);
47 rclcpp::Publisher<px4_msgs::msg::VehicleAttitudeSetpoint>::SharedPtr
48 _vehicle_attitude_setpoint_pub;
void update(float roll, float pitch, float yaw, const Eigen::Vector3f &thrust_setpoint_body, float yaw_sp_move_rate_rad_s=0.f)
Send an attitude setpoint to the flight controller. Euler angles follow the RPY extrinsic Tait-Bryan ...
Definition context.hpp:18