PX4 ROS 2 Interface Library
Library to interface with PX4 from a companion computer using ROS 2
px4_ros2::NodeWithMode< ModeT > Class Template Reference

A ROS2 node which instantiates a control mode and handles its registration with PX4. More...

#include <px4_ros2/components/node_with_mode.hpp>

Inheritance diagram for px4_ros2::NodeWithMode< ModeT >:

Public Member Functions

 NodeWithMode (std::string node_name, bool enable_debug_output=false)
 
ModeT & getMode () const
 

Detailed Description

template<typename ModeT>
class px4_ros2::NodeWithMode< ModeT >

A ROS2 node which instantiates a control mode and handles its registration with PX4.

Template Parameters
ModeTThe mode type, which must be derived from px4_ros2::ModeBase.

Example usage:

class MyMode : public px4_ros2::ModeBase {...};
rclcpp::spin(std::make_shared<px4_ros2::NodeWithMode<MyMode>>("my_node"));
Base class for a mode.
Definition: mode.hpp:70
A ROS2 node which instantiates a control mode and handles its registration with PX4.
Definition: node_with_mode.hpp:33

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