File wgs84.h
↰ Parent directory (include/geodesy
)
WGS 84 geodetic system for ROS latitude and longitude messages.
Definition (include/geodesy/wgs84.h
)
Detailed Description
Standard ROS latitude and longitude coordinates are defined in terms of the World Geodetic System (WGS 84) ellipsoid used by most navigation satellite receivers.
Many other geodetic coordinate systems can be defined. They should always be converted to WGS 84 when publishing ROS messages to avoid confusion among subscribers.
Jack O’Quin
Includes
ctype.h
geographic_msgs/msg/geo_point.hpp
geographic_msgs/msg/geo_pose.hpp
limits
sensor_msgs/msg/nav_sat_fix.hpp
Included By
Namespaces
Functions
Function geodesy::fromMsg(const geographic_msgs::msg::GeoPoint&, geographic_msgs::msg::GeoPoint&)
Function geodesy::fromMsg(const geographic_msgs::msg::GeoPose&, geographic_msgs::msg::GeoPose&)
Function geodesy::is2D(const geographic_msgs::msg::GeoPoint&)
Function geodesy::is2D(const geographic_msgs::msg::GeoPose&)
Function geodesy::isValid(const geographic_msgs::msg::GeoPoint&)
Function geodesy::isValid(const geographic_msgs::msg::GeoPose&)
Function geodesy::normalize(geographic_msgs::msg::GeoPoint&)
Function geodesy::toMsg(const geographic_msgs::msg::GeoPoint&)
Function geodesy::toMsg(const sensor_msgs::msg::NavSatFix&, const geometry_msgs::msg::Quaternion&)
Function geodesy::toMsg(const geographic_msgs::msg::GeoPose&)