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

#include <auto_apms_px4/mode_executor.hpp>

Public Member Functions

 ModeExecutorFactory (const std::string &name, const rclcpp::NodeOptions &options, const std::string &topic_namespace_prefix="", bool deactivate_before_completion=true, std::chrono::milliseconds execution_interval=auto_apms_core::Task< ActionT >::DEFAULT_VALUE_EXECUTION_INTERVAL, std::chrono::milliseconds feedback_interval=auto_apms_core::Task< ActionT >::DEFAULT_VALUE_FEEDBACK_INTERVAL)
 
rclcpp::node_interfaces::NodeBaseInterface::SharedPtr get_node_base_interface ()
 

Detailed Description

template<class ActionT, class ModeT>
class auto_apms_px4::ModeExecutorFactory< ActionT, ModeT >

Definition at line 368 of file mode_executor.hpp.

Constructor & Destructor Documentation

◆ ModeExecutorFactory()

template<class ActionT , class ModeT >
ModeExecutorFactory ( const std::string & name,
const rclcpp::NodeOptions & options,
const std::string & topic_namespace_prefix = "",
bool deactivate_before_completion = true,
std::chrono::milliseconds execution_interval = auto_apms_core::Task<ActionT>::DEFAULT_VALUE_EXECUTION_INTERVAL,
std::chrono::milliseconds feedback_interval = auto_apms_core::Task<ActionT>::DEFAULT_VALUE_FEEDBACK_INTERVAL )

Definition at line 386 of file mode_executor.hpp.

Member Function Documentation

◆ get_node_base_interface()

template<class ActionT , class ModeT >
rclcpp::node_interfaces::NodeBaseInterface::SharedPtr get_node_base_interface ( )

Definition at line 424 of file mode_executor.hpp.


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