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