Only released in EOL distros:
Package Summary
Released
Documented
The rplidar_python package
- Maintainer status: maintained
- Maintainer: howe <xu001314 AT 163 DOT com>
- Author: DinnerHowe
- License: TODO
- Source: git https://github.com/DinnerHowe/rplidar_python.git (branch: master)
Package Summary
Released
Documented
The rplidar_python package
- Maintainer status: maintained
- Maintainer: howe <xu001314 AT 163 DOT com>
- Author: DinnerHowe
- License: TODO
- Source: git https://github.com/DinnerHowe/rplidar_python.git (branch: master)
Contents
Package Summary
- A ROS node for rplidar written in python, which you may need to change port name, if you wanna custom you setting.
- Maintainer status: maintained
Maintainer: Zhihao Xu < zhihao@iscas.ac.cn>
- Author: Zhihao Xu
- License: TODO
Overview
- Before starting this tutorial, make sure you installed two python libs construct and pyserial. The rplidar_python package provides an other solution for RPlidar sensor usage in ros.This packge also allow robot launches a 360 degree scanning map through gmapping module without twisting.
Hardware Requirements
- to use rplidar_python, you should get a robot that provides odometry, like Turtlebot. Also,you need a RPlidar sensor. Here we use RPLIDAR 360 laser scanner development kit.
- we use RPlidar to replace kinect sensor and we mount it in the position of kinect,thus kinect tf frame is useful for RPlidar sensor as well.
Launch Example
- to make a map by RPlidar, you should launch rplidar_gmapping_demo.launch like:
roslaunch rplidar_python rplidar_gmapping_demo.launch
Or you may wanna see laser frame only by typing following command:roslaunch rplidar_python rplidar_demo.launch
Node
driver for RPlidar. Automatically starts sensor and convert data stream into sensor_msgs/LaserScan type. sensor publish topic every frame, one frame contain 360 laser data.
Published Topic
/scan(sensor_msgs/LaserScan)
- output Laser scans to create the map from
Parameters
- range_min (flaot default 0.15)
- the min range that laser can scan
- the min range that laser can scan
- rplidar frame
- the max angle that laser can reach
- the min angle that laser can reach
- angular distance between measurements
- time between scans
- range data
RPlidar c++ tutorial please check at here