AutoAPMS
Resilient Robot Mission Management
|
#include <auto_apms_px4/mode.hpp>
Protected Member Functions | |
PositionAwareMode (rclcpp::Node &node, const px4_ros2::ModeBase::Settings &settings, const std::string &topic_namespace_prefix, std::shared_ptr< ActionContextType > action_context_ptr) | |
bool | IsPositionReached (const Eigen::Vector3d &target_position_f_glob) const |
bool | IsAltitudeReached (float target_altitude_amsl_m) const |
bool | IsHeadingReached (float target_heading_rad) const |
Protected Member Functions inherited from ModeBase< ActionT > | |
ModeBase (rclcpp::Node &node, const Settings &settings, const std::string &topic_namespace_prefix, std::shared_ptr< ActionContextType > action_context_ptr) | |
Protected Attributes | |
std::shared_ptr< px4_ros2::OdometryGlobalPosition > | vehicle_global_position_ptr_ |
std::shared_ptr< px4_ros2::OdometryLocalPosition > | vehicle_local_position_ptr_ |
std::shared_ptr< px4_ros2::OdometryAttitude > | vehicle_attitude_ptr_ |
Additional Inherited Members | |
Protected Types inherited from ModeBase< ActionT > | |
using | ActionContextType = auto_apms_core::ActionContext<ActionT> |
using | Goal = typename ActionContextType::Goal |
using | Result = typename ActionContextType::Result |
using | Feedback = typename ActionContextType::Feedback |
|
inlineprotected |
|
protected |
|
protected |
|
protected |
|
protected |
|
protected |
|
protected |