ros-fuerte-pcl: bug in libfiter.so? [closed]

asked 2012-09-05 21:55:54 -0500

this post is marked as community wiki

This post is a wiki. Anyone with karma >75 is welcome to improve it.

Hi,

I updated ROS and now I have problems with the libfilter.so. I cannot use voxel_grid, i get an error like this: "Program received signal SIGILL, Illegal instruction."

My system: 3.2.0-30-generic #48-Ubuntu SMP x86_64 x86_64 x86_64 GNU/Linux Intel(R) Core(TM)2 Quad CPU Q6600 @ 2.40GHz

ROS: i think the package with the error is: ros-fuerte-pcl (1.5.2-7precise-20120813-1659-+0000)

Problem: When i run voxelgrid (from /opt/ros/fuerte/bin/) to downsample a pcd-file i get the error, with gdb i get this:

robert@raquel:~$ voxel_grid table_scene_lms400.pcd test.pcd

Program received signal SIGILL, Illegal instruction. 0x00007ffff740c719 in pcl::VoxelGrid<sensor_msgs::pointcloud2_<std::allocator<void> > >::applyFilter(sensor_msgs::PointCloud2_<std::allocator<void> >&) () from /opt/ros/fuerte/lib/libpcl_filters.so.1.5 (gdb)

/#0 0x00007ffff740c719 in pcl::VoxelGrid<sensor_msgs::pointcloud2_<std::allocator<void> > >::applyFilter(sensor_msgs::PointCloud2_<std::allocator<void> >&) () from /opt/ros/fuerte/lib/libpcl_filters.so.1.5

/#1 0x00007ffff7335de8 in pcl::Filter<sensor_msgs::pointcloud2_<std::allocator<void> > >::filter(sensor_msgs::PointCloud2_<std::allocator<void> >&) () from /opt/ros/fuerte/lib/libpcl_filters.so.1.5

/#2 0x0000000000408d74 in compute(boost::shared_ptr<sensor_msgs::pointcloud2_<std::allocator<void> > const> const&, sensor_msgs::PointCloud2_<std::allocator<void> >&, float, float, float, std::string const&, double, double) ()

/#3 0x0000000000407ade in main ()

To test voxel_grid i tried out the tutorial on voxel_grid (link:pcl), compiling/linking no problem, but when i execute the program similar error as above :-(

What i tried and works is to download the trunk version of percption_pcl_fuerte_unstable (link:svn).

Now to the strange part: i also have a laptop with the same software settings and there i get no errors (CPU info: 2.0 GHz Intel Core 2 Duo).

Is there a bug in the pre-build packages? Is someone else experiences the same bahaviour?

Thx, Robert

edit retag flag offensive reopen merge delete

Closed for the following reason question is not relevant or outdated by tfoote
close date 2013-09-18 13:00:48