Program Listing for File qos.hpp

Return to documentation for file (include/mavros/qos.hpp)

/*
 * Copyright 2025 Vladimir Ermakov.
 *
 * This file is part of the mavros package and subject to the license terms
 * in the top-level LICENSE file of the mavros repository.
 * https://github.com/mavlink/mavros/tree/master/LICENSE.md
 */
#pragma once

#ifndef MAVROS__QOS_HPP_
#define MAVROS__QOS_HPP_

#include "rclcpp/rclcpp.hpp"

namespace mavros
{

static inline rclcpp::QoS LatchedStateQoS()
{
  return rclcpp::QoS(10).keep_last(1).reliable().transient_local();
}

}       // namespace mavros

#endif  // MAVROS__QOS_HPP_