Struct Vector3
Defined in File fluent_rviz.hpp
Inheritance Relationships
Base Type
public geometry_msgs::msg::Vector3
Struct Documentation
-
struct Vector3 : public geometry_msgs::msg::Vector3
Public Functions
-
inline Vector3(const double x, const double y, const double z) noexcept
Public Static Functions
-
template<class Return = Vector3>
static inline auto UnitX() noexcept -> std::enable_if_t<is_vec3_compat_v<Return>, Return>
-
template<class Return = Vector3>
static inline auto UnitY() noexcept -> std::enable_if_t<is_vec3_compat_v<Return>, Return>
-
template<class Return = Vector3>
static inline auto UnitZ() noexcept -> std::enable_if_t<is_vec3_compat_v<Return>, Return>
-
inline Vector3(const double x, const double y, const double z) noexcept