Only released in EOL distros:
Package Summary
The s3000_laser package
- Maintainer: Román Navarro <rnavarro AT robotnik DOT es>
- Author: Román Navarro <rnavarro AT robotnik DOT es>
- License: BSD
- Source: git https://github.com/RobotnikAutomation/s3000_laser.git (branch: groovy-devel)
Package Summary
The s3000_laser package
- Maintainer status: developed
- Maintainer: Román Navarro <rnavarro AT robotnik DOT es>
- Author: Román Navarro <rnavarro AT robotnik DOT es>
- License: BSD
- Source: git https://github.com/RobotnikAutomation/s3000_laser.git (branch: hydro-devel)
Package Summary
The s3000_laser package
- Maintainer status: maintained
- Maintainer: Roberto Guzmán <rguzman AT robotnik DOT es>, Roman Navarro Garcia <rnavarro AT robotnik DOT es>, Toni Aliques <aaliques AT robotnik DOT com>
- Author: Roman Navarro Garcia <rnavarro AT robotnik DOT es>
- License: BSD
- Bug / feature tracker: https://github.com/RobotnikAutomation/s3000_laser/issues
- Source: git https://github.com/RobotnikAutomation/s3000_laser.git (branch: indigo-devel)
Description
Driver for ROS to read the scan data from the device SICK S3000. This driver is based on the original driver developed for Player/Stage by Brian Gerkey, Kasper Stoy, Richard Vaughan, & Andrew Howard.
This driver controls the SICK S3000 safety laser scanner interpreting its data output. The driver is very basic and assumes the S3000 has already been configured to continuously output its measured data on the RS422 data lines.
Supported Hardware
This package should work with SICK S3000 safety laser scanners.
Nodes
s3000_laser
S3000 laser driver.Published Topics
s3000_laser/scan (sensor_msgs/LaserScan)- Scan data from the laser, containing either range data or reflector detections.
Parameters
~port (string, default: "/dev/ttyUSB0")- Serial port.
- Relative frame for the publication of the laser measures.
- Serial port baudrate (options: 9600, 19200, 38400, 115200, 500000).
- Serial port parity (options: "even", "odd", "none").
- Character size mask for serial link (options: 5,6,7,8).
- Min valid range (m) for S3000 data produced.
- Max valid range (m) for S3000 data.