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
173 stars 204 forks source link

Can't locate node laser_scan_filters #66

Closed abylikhsanov closed 5 years ago

abylikhsanov commented 5 years ago

I want to filter the angles of the laser scans and wrote a launch file:

<launch>
  <node pkg="laser_filters" type="laser_scan_filters" output="screen" name="laser_scan">
    <rosparam command="load" file="$(find laser_filters)/launch/angle_filter.yaml" />
  </node>
</launch>

However, when I try to execute it, I get this error: ERROR: cannot launch node of type [laser_filters/laser_scan_filters]: can't locate node [laser_scan_filters] in package [laser_filters]

Which is quite strange as there is a c++ executable in CMakeLists.

Any thoughts?

jonbinney commented 5 years ago

I'd suggest asking this on ROS answers - sounds like a problem with your catkin workspace or launchfile syntax, not with the code.