|
PX4 ROS 2 Interface Library
Library to interface with PX4 from a companion computer using ROS 2
|
Base class for position measurement interface. More...
#include <px4_ros2/navigation/experimental/navigation_interface_base.hpp>
Public Member Functions | |
| PositionMeasurementInterfaceBase (rclcpp::Node &node, std::string topic_namespace_prefix="") | |
| bool | doRegister () |
Public Member Functions inherited from px4_ros2::Context | |
| Context (rclcpp::Node &node, std::string topic_namespace_prefix="") | |
| rclcpp::Node & | node () |
| const std::string & | topicNamespacePrefix () const |
| virtual void | addSetpointType (SetpointBase *setpoint) |
| virtual void | setRequirement (const RequirementFlags &requirement_flags) |
Protected Attributes | |
| rclcpp::Node & | _node |
Base class for position measurement interface.
|
inline |
Register the interface.