41 void update(
const Eigen::Vector3f& position,
const std::optional<float>& heading = {},
42 const std::optional<float>& max_horizontal_speed = {},
43 const std::optional<float>& max_vertical_speed = {},
44 const std::optional<float>& max_heading_rate = {});
46 float desiredUpdateRateHz()
override {
return 30.f; }
50 rclcpp::Publisher<px4_msgs::msg::GotoSetpoint>::SharedPtr _goto_setpoint_pub;
73 void update(
const Eigen::Vector3d& global_position,
const std::optional<float>& heading = {},
74 const std::optional<float>& max_horizontal_speed = {},
75 const std::optional<float>& max_vertical_speed = {},
76 const std::optional<float>& max_heading_rate = {});
80 std::unique_ptr<MapProjection> _map_projection;
81 std::shared_ptr<MulticopterGotoSetpointType> _goto_setpoint;
Definition context.hpp:18
void update(const Eigen::Vector3d &global_position, const std::optional< float > &heading={}, const std::optional< float > &max_horizontal_speed={}, const std::optional< float > &max_vertical_speed={}, const std::optional< float > &max_heading_rate={})
Go-to global setpoint update.
void update(const Eigen::Vector3f &position, const std::optional< float > &heading={}, const std::optional< float > &max_horizontal_speed={}, const std::optional< float > &max_vertical_speed={}, const std::optional< float > &max_heading_rate={})
Go-to setpoint update.