Template Struct access< T, std::enable_if_t< std::is_base_of_v< std_msgs::msg::ColorRGBA, T > > >
Defined in File fluent_rviz.hpp
Struct Documentation
-
template<class T>
struct access<T, std::enable_if_t<std::is_base_of_v<std_msgs::msg::ColorRGBA, T>>> Public Static Functions
-
template<size_t I>
static inline float get(const std_msgs::msg::ColorRGBA &t) noexcept
-
template<size_t I>
static inline void set(std_msgs::msg::ColorRGBA &t, float value) noexcept
Public Static Attributes
-
static constexpr size_t size = 4
-
template<size_t I>