Function mavros_msgs::mavlink::convert(const Mavlink&, mavlink_message_t&)
Defined in File mavlink_convert.hpp
Function Documentation
-
inline bool mavros_msgs::mavlink::convert(const Mavlink &rmsg, mavlink_message_t &mmsg)
Convert mavros_msgs/Mavlink message to mavlink_message_t.
Note
signature vector should be empty for unsigned OR MAVLINK_SIGNATURE_BLOCK size for signed messages
- Parameters:
rmsg – [in] mavros_msgs/Mavlink message
mmsg – [out] mavlink_message_t struct
- Returns:
true if success