Template Struct access< T, std::enable_if_t< std::is_base_of_v< geometry_msgs::msg::Quaternion, T > > >

Struct Documentation

template<class T>
struct access<T, std::enable_if_t<std::is_base_of_v<geometry_msgs::msg::Quaternion, T>>>

Public Static Functions

template<size_t I>
static inline double get(const geometry_msgs::msg::Quaternion &t) noexcept
template<size_t I>
static inline void set(geometry_msgs::msg::Quaternion &t, double value) noexcept

Public Static Attributes

static constexpr size_t size = 4