Wiki

  Show EOL distros: 

Package Summary

Package to parse NMEA strings and publish a very simple GPS messgae. Does not require the GPSD deamon.

Package Summary

Package to parse NMEA strings and publish a very simple GPS message. Does not require the GPSD deamon.

Package Summary

Package to parse NMEA strings and publish a very simple GPS message. Does not require the GPSD deamon.

Package Summary

Package to parse NMEA strings and publish a very simple GPS message. Does not require or use the GPSD deamon.

Package Summary

Package to parse NMEA strings and publish a very simple GPS message. Does not require or use the GPSD deamon.

Package Summary

Package to parse NMEA strings and publish a very simple GPS message. Does not require or use the GPSD deamon.

Overview

This package provides a ROS interface for GPS devices that output compatible NMEA sentences. See the GPSD documentation of NMEA sentences for details on the raw format. Of the thousands of NMEA-compatible GPS devices, we are compiling a list of devices known to be supported.

This package is compatible with the geographic_info project as well as any other nodes that support sensor_msgs/NavSatFix and/or sensor_msgs/TimeReference.

No C++ or Python API is provided, only a ROS API.

This package replaces the nmea_gps_driver package present in Fuerte and Groovy.

Sample Usage

To get up and running quickly, you can use the following command to start outputting your GPS data onto ROS topics. This assumes your GPS is outputting GGA NMEA sentences, is connected to /dev/ttyUSB0 and is communicating at 38400 baud.

$ rosrun nmea_navsat_driver nmea_serial_driver _port:=/dev/ttyUSB0 _baud:=38400

Roadmap

Nodes

nmea_topic_driver

NMEA GPS Topic driver node. Reads NMEA sentences from a ROS topic instead of directly from e.g. a serial port.

Subscribed Topics

nmea_sentence (nmea_msgs/Sentence)

Published Topics

fix (sensor_msgs/NavSatFix) vel (geometry_msgs/TwistStamped) time_reference (sensor_msgs/TimeReference)

Parameters

~time_ref_source (string, default: <the value of ~frame_id>) ~useRMC (bool, default: False)

nmea_serial_driver

NMEA GPS Serial driver node. Replaces nmea_gps_driver.py to reduce naming conflicts and use new common parsing+driver backend.

Published Topics

fix (sensor_msgs/NavSatFix) vel (geometry_msgs/TwistStamped) time_reference (sensor_msgs/TimeReference)

Parameters

~port (string, default: /dev/ttyUSB0) ~baud (int, default: 4800) ~frame_id (string, default: gps) ~time_ref_source (string, default: <the value of ~frame_id>) ~useRMC (bool, default: False)

nmea_topic_serial_reader

Reads NMEA sentences from the specified serial port and publishes them to a ROS topic. This is a simple front-end for use with nmea_topic_driver.py

Published Topics

nmea_sentence (nmea_msgs/Sentence)

Parameters

~port (string, default: /dev/ttyUSB0) ~baud (int, default: 4800) ~frame_id (string, default: gps)

Troubleshooting

If you are using this package for the first time and encountering problems you should first check that the package installed correctly and in the right location. Then consult ROS/Troubleshooting, FAQ and http://answers.ros.org/questions/ to see if a solution has already been identified for your problem.

If you are having trouble with nmea_serial_driver and connecting to a serial port, ensure that the user has permission to access the port by checking to see if the user is part of the "dialout" group. See here for more information.

Report a Bug

Use GitHub to report bugs or submit feature requests. [View active issues]

Wiki: nmea_navsat_driver (last edited 2020-06-13 19:05:16 by EdVenator)