Template Function compass_conversions::getAzimuthTopicSuffix

Function Documentation

template<typename T, typename ::std::enable_if_t<std::is_same_v<T, compass_interfaces::msg::Azimuth> || std::is_same_v<T, geometry_msgs::msg::PoseWithCovarianceStamped> || std::is_same_v<T, geometry_msgs::msg::QuaternionStamped> || std::is_same_v<T, sensor_msgs::msg::Imu>>* = nullptr>
std::string compass_conversions::getAzimuthTopicSuffix(Unit unit, Orientation orientation, Reference reference)

Get the suffix of topic name that identifies the particular representation of azimuth.

Template Parameters:

T – Type of the message carrying the azimuth information.

Parameters:
  • unit[in] Angular units (only make sense for Azimuth messages).

  • orientation[in] ENU or NED orientation of the world.

  • reference[in] What North reference does the azimuth use.

Returns:

The suffix.