Class Router
Defined in File mavros_router.hpp
Inheritance Relationships
Base Type
public rclcpp::Node
Class Documentation
-
class Router : public rclcpp::Node
Router class implements MAVROS Router node
Router is essential part that connects several MAVLink devices together. In general there are three device classes that router uses:
a FCU endpoint - should be faced to autopilot firmware(s),
a GCS endpoint - that ep connects control software
a UAS endpoint - special type of endpoint that is used to connect MAVROS UAS node(s) to FCU(s)
Some traffic rules:
FCU broadcast -> GCS, UAS, but not to any other FCU
FCU targeted system/component -> GCS/UAS endpoint that have matching address
FCU targeted system -> same as for p.2
GCS broadcast -> FCU, UAS
GCS targeted -> FCU/UAS maching addr
UAS broadcast -> FCU, GCS
UAS targeted -> FCU/GCS
Public Types
-
using StrV = std::vector<std::string>