[ROS] PointCloud2 to LaserScan
sensor_msgs/PointCloud2
μμ sensor_msgs/LaserScan
λ‘ λ³ννμ
μ€λͺ
κ°λ¨νλ€
launch νμΌ νλλ§ μμ±νλ©΄ λ¨!
μ½λ
remap νλ λΆλΆμμ cloud_in
μ PointCloud2 ν ν½μ΄λ¦μ λ£μ΄μ£Όκ³ ,
scan
λΆλΆμ publishλ ν ν½ μ΄λ¦μ λ£μ΄μ€λ€!
κ·Έ μΈμ rosparam
κ°μ κ²½μ° κ²μκΈ μ μΌ νλ¨ ros wiki λ νΌλ°μ€λ₯Ό μ°Έμ‘°νμ¬ μμ ν΄μ£Όμ!
<launch>
<!-- Run pointcloud_to_laser node -->
<node pkg="pointcloud_to_laserscan" type="pointcloud_to_laserscan_node" name="pointcloud_to_laserscan" >
<remap from="cloud_in" to="keypoints_cloud"/>
<remap from="scan" to="keypoints/scan"/>
<rosparam>
target_frame: base_link # Leave disabled to output scan in pointcloud frame
transform_tolerance: 0.01
min_height: -10.0
max_height: 10.0
angle_min: -3.141591 # -M_PI
angle_max: 3.141591 # M_PI
angle_increment: 0.0087 # M_PI/360.0 (every degreee)
scan_time: 1.0
range_min: 0.3
range_max: 100.0
use_inf: true
# Concurrency level, affects number of poinclouds queued for processing and number of threads used
# 0: Detect Number of cored
# 1: Single threaded
# 2->inf : Parallelism level
concurrency_level: 1
</rosparam>
</node>
</launch>
Leave a comment