AutoAPMS
Resilient Robot Mission Management
Loading...
Searching...
No Matches
ModeExecutor< ActionT > Member List

This is the complete list of members for ModeExecutor< ActionT >, including all inherited members.

action_context_ptr_Task< ActionT >protected
ActionContextType typedefTask< ActionT >
DEFAULT_VALUE_EXECUTION_INTERVALTask< ActionT >static
DEFAULT_VALUE_FEEDBACK_INTERVALTask< ActionT >static
Feedback typedefTask< ActionT >
FlightMode typedefModeExecutor< ActionT >
get_node_base_interface() constTask< ActionT >
getModeID() constModeExecutor< ActionT >protected
Goal typedefTask< ActionT >
GoalHandle typedefTask< ActionT >
isCompleted(std::shared_ptr< const Goal > goal_ptr, const px4_msgs::msg::VehicleStatus &vehicle_status)ModeExecutor< ActionT >protectedvirtual
isCurrentNavState(uint8_t nav_state)ModeExecutor< ActionT >protected
ModeExecutor(const std::string &name, rclcpp::Node::SharedPtr node_ptr, std::shared_ptr< ActionContextType > action_context_ptr, uint8_t mode_id, bool deactivate_before_completion=true, std::chrono::milliseconds execution_interval=DEFAULT_VALUE_EXECUTION_INTERVAL, std::chrono::milliseconds feedback_interval=DEFAULT_VALUE_FEEDBACK_INTERVAL)ModeExecutor< ActionT >explicit
ModeExecutor(const std::string &name, const rclcpp::NodeOptions &options, uint8_t mode_id, bool deactivate_before_completion=true, std::chrono::milliseconds execution_interval=DEFAULT_VALUE_EXECUTION_INTERVAL, std::chrono::milliseconds feedback_interval=DEFAULT_VALUE_FEEDBACK_INTERVAL)ModeExecutor< ActionT >explicit
ModeExecutor(const std::string &name, const rclcpp::NodeOptions &options, FlightMode flight_mode, bool deactivate_before_completion=true, std::chrono::milliseconds execution_interval=DEFAULT_VALUE_EXECUTION_INTERVAL, std::chrono::milliseconds feedback_interval=DEFAULT_VALUE_FEEDBACK_INTERVAL)ModeExecutor< ActionT >explicit
node_ptr_Task< ActionT >protected
PARAM_NAME_FEEDBACK_INTERVALTask< ActionT >static
Result typedefTask< ActionT >
sendActivationCommand(const VehicleCommandClient &client, std::shared_ptr< const Goal > goal_ptr)ModeExecutor< ActionT >protectedvirtual
setFeedback(std::shared_ptr< Feedback > feedback_ptr, const px4_msgs::msg::VehicleStatus &vehicle_status)ModeExecutor< ActionT >protectedvirtual
Status typedefTask< ActionT >
Task(const std::string &name, rclcpp::Node::SharedPtr node_ptr, std::shared_ptr< ActionContextType > action_context_ptr, std::chrono::milliseconds execution_interval=DEFAULT_VALUE_EXECUTION_INTERVAL, std::chrono::milliseconds feedback_interval=DEFAULT_VALUE_FEEDBACK_INTERVAL)Task< ActionT >explicit
Task(const std::string &name, rclcpp::Node::SharedPtr node_ptr, std::chrono::milliseconds execution_interval=DEFAULT_VALUE_EXECUTION_INTERVAL, std::chrono::milliseconds feedback_interval=DEFAULT_VALUE_FEEDBACK_INTERVAL)Task< ActionT >explicit
Task(const std::string &name, const rclcpp::NodeOptions &options, std::chrono::milliseconds execution_interval=DEFAULT_VALUE_EXECUTION_INTERVAL, std::chrono::milliseconds feedback_interval=DEFAULT_VALUE_FEEDBACK_INTERVAL)Task< ActionT >explicit
TaskStatus typedefModeExecutor< ActionT >