Only released in EOL distros:  

Corobot: PhidgetMotor | PhidgetServo | corobot_arm | corobot_camera | corobot_gps | corobot_hokuyo | corobot_joystick | corobot_map_to_jpeg | corobot_msgs | corobot_pantilt | corobot_phidgetIK | corobot_srvs | corobot_ssc32 | corobot_state_tf | corobot_teleop

Package Summary

corobot_gps connects to a GPSd server and broadcasts GPS fixes using the NavSatFix message. The package is based of the gpsd_client package made by Rob Thomson and Ken Tossell.

corobot: corobot_arm | corobot_camera | corobot_diagnostics | corobot_gazebo | corobot_gps | corobot_joystick | corobot_launch | corobot_msgs | corobot_pantilt | corobot_phidget_ik | corobot_ssc32 | corobot_state_tf | corobot_teleop | corobot_urdf | map_to_jpeg | phidget_motor | phidget_servo | phidget_stepper

Package Summary

corobot_gps connects to a GPSd server and broadcasts GPS fixes using the NavSatFix message. The package is based of the gpsd_client package made by Rob Thomson and Ken Tossell.

corobot: corobot_arm | corobot_camera | corobot_diagnostics | corobot_gazebo | corobot_gps | corobot_joystick | corobot_launch | corobot_msgs | corobot_pantilt | corobot_phidget_ik | corobot_ssc32 | corobot_state_tf | corobot_teleop | corobot_urdf | map_to_jpeg | phidget_motor | phidget_servo | phidget_stepper

Package Summary

corobot_gps connects to a GPSd server and broadcasts GPS fixes using the NavSatFix message. The package is based of the gpsd_client package made by Rob Thomson and Ken Tossell.

Supported Hardware

This driver should works with any gps sensor

ROS API

corobot_gps

corobot_gps is a driver for gps sensors. This driver was designed to get gps data for the Corobot.

Published Topics

extended_fix (corobot_msgs/GPSFix)
  • Send the gps data
fix (sensor_msgs/NavSatFix)
  • Send the gps data

Parameters

use_gps_time (bool, default: true)
  • use the time from the gps
host (string, default: localhost)
  • host name or ip address of the computer connected to the gps
port (int, default: 2947)
  • port where the gps sends data to

Troubleshooting

Here is what you can do to configure your system to use your GPS:

First find out which port the gps used. For that, disconnect et reconnect your gps and in a terminal type

dmesg

Now open the file /etc/default/gpsd

sudo gedit /etc/default/gpsd

and change the line DEVICES="" by DEVICES="/dev/ttyUSB0" making sure that the port is the one the command dmesg gave you.

Lastely, create a rules file to get permission to use the gps device

touch /etc/udev/rules.d/corobot.rules
echo 'KERNEL=="ttyUSB0", GROUP="users", MODE="0666"' >> /etc/udev/rules.d/corobot.rules

Make sure the change the port, ttyUSB0, by the port dmesg gave you, generally in the form tty*.

Now you just need to restart the robot.

Wiki: corobot_gps (last edited 2013-09-25 15:20:53 by MorganCormier)