AutoAPMS
Resilient Robot Mission Management
Loading...
Searching...
No Matches
PositionAwareMode< ActionT > Class Template Reference

#include <auto_apms_px4/mode.hpp>

Inheritance diagram for PositionAwareMode< ActionT >:

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
 

Detailed Description

template<class ActionT>
class auto_apms_px4::PositionAwareMode< ActionT >

Definition at line 80 of file mode.hpp.

Constructor & Destructor Documentation

◆ PositionAwareMode()

template<class ActionT >
PositionAwareMode ( rclcpp::Node & node,
const px4_ros2::ModeBase::Settings & settings,
const std::string & topic_namespace_prefix,
std::shared_ptr< ActionContextType > action_context_ptr )
inlineprotected

Definition at line 85 of file mode.hpp.

Member Function Documentation

◆ IsPositionReached()

template<class ActionT >
bool IsPositionReached ( const Eigen::Vector3d & target_position_f_glob) const
protected

Definition at line 105 of file mode.hpp.

◆ IsAltitudeReached()

template<class ActionT >
bool IsAltitudeReached ( float target_altitude_amsl_m) const
protected

Definition at line 116 of file mode.hpp.

◆ IsHeadingReached()

template<class ActionT >
bool IsHeadingReached ( float target_heading_rad) const
protected

Definition at line 124 of file mode.hpp.

Member Data Documentation

◆ vehicle_global_position_ptr_

template<class ActionT >
std::shared_ptr<px4_ros2::OdometryGlobalPosition> vehicle_global_position_ptr_
protected

Definition at line 99 of file mode.hpp.

◆ vehicle_local_position_ptr_

template<class ActionT >
std::shared_ptr<px4_ros2::OdometryLocalPosition> vehicle_local_position_ptr_
protected

Definition at line 100 of file mode.hpp.

◆ vehicle_attitude_ptr_

template<class ActionT >
std::shared_ptr<px4_ros2::OdometryAttitude> vehicle_attitude_ptr_
protected

Definition at line 101 of file mode.hpp.


The documentation for this class was generated from the following file: