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>

Reference

Leave a comment