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

pointcloud filters bug find. #40

Open asimay opened 8 years ago

asimay commented 8 years ago

[ERROR] [1456740060.773385720]: Couldn't find filter of type laser_filters/PointCloudFootprintFilter when use laser_filters/PointCloudFootprintFilter filter. find the reason: scan_to_cloud_filter_chain.cpp listen the Pointcloud2 message, but point_cloud_footprint_filter.h send & plugin files registered with Pointcloud message. message is not coincide with each other, so compile is no error, but run error.

jonbinney commented 8 years ago

Sounds like laser_filters/PointCloudFootprintFilter was never updated to use the PointCloud2 message type. Shouldn't be too hard to fix; any chance you could submit another PR for this? :-)

jonbinney commented 8 years ago

Actually it looks like that filter is deprecated. Can you use "footprint filter" instead?

https://github.com/ros-perception/laser_filters/blob/indigo-devel/include/laser_filters/footprint_filter.h

It operates directly on laser scans.

asimay commented 8 years ago

yes. footprint filter maybe able to work. because it listens the laserscan massage, not Pointcloud massage, i just want to test point cloud filter. so maybe this project still need more development about newer's filters code.