Only released in EOL distros:
Package Summary
This package contains a node that connects to the Neato Robotics XV-11. It enables control of motors through a geometry_msgs/Twist topic and publishes laser scans and odometry.
- Author: Michael Ferguson
- License: BSD
- Source: svn https://albany-ros-pkg.googlecode.com/svn/trunk/neato_robot
Package Summary
This package contains a node that connects to the Neato Robotics XV-11. It enables control of motors through a geometry_msgs/Twist topic and publishes laser scans and odometry.
- Author: Michael Ferguson
- License: BSD
- Source: svn https://albany-ros-pkg.googlecode.com/svn/trunk/neato_robot
Package Summary
A node wrapper for the neato_driver package
- Maintainer: Michael Ferguson <ferguson AT cs.albany DOT edu>
- Author: Michael Ferguson
- License: BSD
- Source: git https://github.com/mikeferguson/neato_robot.git (branch: groovy-devel)
Package Summary
A node wrapper for the neato_driver package
- Maintainer: Michael Ferguson <ferguson AT cs.albany DOT edu>
- Author: Michael Ferguson
- License: BSD
- Source: git https://github.com/mikeferguson/neato_robot.git (branch: hydro-devel)
Overview
This package provides a node wrapper for the neato_driver code. It allows control of the Neato XV-11.
ROS API
neato.py
Provides an ROS interface to the Neato XV-11 robot.Subscribed Topics
/cmd_vel (geometry_msgs/Twist)- Velocity commands for the mobile base
Published Topics
/base_scan (sensor_msgs/LaserScan)- Laser output from the Neato robot.
- Odometry output from the Neato robot.
Parameters
~port (str, default: /dev/ttyUSB0)- Name of serial port to use.
Running
Plug in your neato. Then run:
lsusb
Find the neato device (ours was ID 2108:780b). Then:
sudo modprobe usbserial vendor=0x2108 product=0x780b
You should now have a /dev/ttyUSBX like device connected. You can start the neato node by:
roslaunch neato_node bringup.launch
This loads the node and a static TF transformer for base_laser to base_link.