ros-perception / laser_filters

Assorted filters designed to operate on 2D planar laser scanners, which use the sensor_msgs/LaserScan type.
BSD 3-Clause "New" or "Revised" License
161 stars 199 forks source link

Laser_filter launch file does not do anything when launched, base_scan might be issue? #152

Closed PhilipAmadasun closed 2 years ago

PhilipAmadasun commented 2 years ago

I'm using a turtlebot3 which publishes all its LiDAR sensor data to the /scan topic. I need to use the laser_filters package to clean up the data. I installed the package and this is the launch file I made, according to the example in the wiki to try to use this package.

<launch>
  <node pkg="laser_filters" type="scan_to_scan_filter_chain"
      name="laser_filter">
    <rosparam command="load" file="$(find test)/my_laser_config.yaml"/>
    <remap from="scan" to="base_scan"/>
  </node>
</launch>

I roslaunch the file above and it literally does nothing, I rostopic echo /base_scan and no information is being sent to that topic. What do I do? I'm at my wits end. when I delete this line <remap from="scan" to="base_scan"/>, I get an error. when I change "base_scan" to "$(arg scan_topic)", I get an error. Please I need help. What am I doing wrong?

jonbinney commented 2 years ago

This kind of high level debugging question would be better for ROS answers. Could you ask it there? https://answers.ros.org/questions/

PhilipAmadasun commented 2 years ago

@jonbinney I did so here.