Package Summary
Released
Documented
ROS driver package for LSC-C Series
- Maintainer status: maintained
- Maintainer: Autonics-lidar <lidar-ros AT autonics DOT com>
- Author: Autonics-lidar <lidar-ros AT autonics DOT com>
- License: BSD
- Source: git https://github.com/AutonicsLiDAR/lsc_ros_driver.git (branch: master)
Package Summary
Released
Documented
ROS driver package for LSC-C Series
- Maintainer status: maintained
- Maintainer: Autonics-lidar <lidar-ros AT autonics DOT com>
- Author: Autonics-lidar <lidar-ros AT autonics DOT com>
- License: BSD
- Source: git https://github.com/AutonicsLiDAR/lsc_ros_driver.git (branch: master)
Contents
Supported hardware
model name : LSC Series
web site : Autonics.com
Features :
- Environment of use : indoor
- Scanning frequency : 15Hz
- Angular resolution : 0.33º
- Aparture angle : 270º
- Detection distance range
- LSC-C5CT3 : 0.05m ~ 5m
- LSC-C10CT3 : 0.05m ~ 10m
- LSC-C25CT3 : 0.05m ~ 25m
ROS API
lsc_ros_driver
lsc_ros_driver is ROS1 driver package for LSC Series of Autonics. It converts scan data from device to LaserScan topic message and publishes.Published Topics
scan (sensor_msgs/LaserScan)- Scan data from the device.
- Scan topic status.
Services
self_test (diagnostic_msgs/SelfTest)- check communication connection
Parameters
addr (string, default: 192.168.0.1)- The device ip address
- The port number of device
- The frame name of scan data
- Minimum range value [m]
- Maximum range value [m]
- Password to login LSC
Installation
from source
source /opt/ros/$ROS_DISTRO/setup.bash mkdir -p ~/catkin_ws/src/ cd ~/catkin_ws/src/ git clone https://github.com/AutonicsLiDAR/lsc_ros_driver.git cd ~/catkin_ws catkin_make source ~/catkin_ws/devel/setup.bash
from binary
sudo apt install ros-$ROS_DISTRO-lsc-ros-driver
Start
roslaunch lsc_ros_driver lsc_c25_launch.launch