|
template<typename T , typename ::std::enable_if_t< std::is_same< T, compass_msgs::Azimuth >::value||std::is_same< T, geometry_msgs::PoseWithCovarianceStamped >::value||std::is_same< T, geometry_msgs::QuaternionStamped >::value||std::is_same< T, sensor_msgs::Imu >::value > * = nullptr> |
std::string | getAzimuthTopicSuffix (decltype(compass_msgs::Azimuth::unit) unit, decltype(compass_msgs::Azimuth::orientation) orientation, decltype(compass_msgs::Azimuth::reference) reference) |
| Get the suffix of topic name that identifies the particular representation of azimuth. More...
|
|
cras::optional< std::tuple< decltype(compass_msgs::Azimuth::unit), decltype(compass_msgs::Azimuth::orientation), decltype(compass_msgs::Azimuth::reference)> > | parseAzimuthTopicName (const boost::shared_ptr< ros::M_string > &connectionHeaderPtr) |
| Autodetect azimuth representation from connection header of a topic it came on. More...
|
|
cras::optional< std::tuple< decltype(compass_msgs::Azimuth::unit), decltype(compass_msgs::Azimuth::orientation), decltype(compass_msgs::Azimuth::reference)> > | parseAzimuthTopicName (const std::string &topic) |
| Autodetect azimuth representation from the name of the topic on which the message came. More...
|
|
template<typename T , typename ::std::enable_if_t< std::is_same< T, compass_msgs::Azimuth >::value||std::is_same< T, geometry_msgs::PoseWithCovarianceStamped >::value||std::is_same< T, geometry_msgs::QuaternionStamped >::value||std::is_same< T, sensor_msgs::Imu >::value > * = nullptr>
std::string compass_conversions::getAzimuthTopicSuffix |
( |
decltype(compass_msgs::Azimuth::unit) |
unit, |
|
|
decltype(compass_msgs::Azimuth::orientation) |
orientation, |
|
|
decltype(compass_msgs::Azimuth::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
-
[in] | unit | Angular units (only make sense for Azimuth messages). |
[in] | orientation | ENU or NED orientation of the world. |
[in] | reference | What North reference does the azimuth use. |
- Returns
- The suffix.