neo_sick_s300-2¶
Summary¶
The neo_sick_s300-2 package provides a means to access laser scan information from a Sick S300 scanner.
neo_sick_s300_node¶
(usually the node named as lidar_1, lidar_2, etc)
Connects to the S300 scanner over serial bus and publishes the data to ROS.
Publishes:
- /lidar_x/scan (sensor_msgs/LaserScan)
Parameters¶
port: |
|
||||
---|---|---|---|---|---|
baud: |
|
||||
scan_duration: |
|
||||
scan_delay: |
|
||||
frame_id: |
|
Attention
The support for frame_id parameter is depreciated in ROS 2. See the notes for ROS 2 below.
The namespacing for the laser scanners are described directly through the launch file. It is assumed that the namespacing string and the frame_id of the laser scanners are the same. Thus, this needs to be noted while configuring the laser scanners.
The configuration of the neo_mp_400 serves as a nice example to address this point.
neo_scan_filter_node¶
(usually named as lidar_1_filter, lidar_2_filter, etc)
Filters out ranges from the original scan data where the view is obstructed, by setting the corresponding ranges to zero.
Publishes:
- /lidar_x/scan_filtered (sensor_msgs/LaserScan)
Subscribes:
- /lidar_x/scan (sensor_msgs/LaserScan)
Parameters¶
scan_intervals: |
|
---|