In fact there was a mistake in the tutorial. There is actually a missing dependency:<br><br>target_link_libraries (tutorial_filter_voxel_grid pcl_io <b>pcl_filters</b>)<br><br>Regards<br><br><br><div class="gmail_quote">On Thu, Jun 10, 2010 at 9:34 AM, Jordi Pages <span dir="ltr"><<a href="mailto:jordi.pages@pal-robotics.com">jordi.pages@pal-robotics.com</a>></span> wrote:<br>
<blockquote class="gmail_quote" style="margin: 0pt 0pt 0pt 0.8ex; border-left: 1px solid rgb(204, 204, 204); padding-left: 1ex;">Hi,<br><br>I have some trouble trying to compile the latest svn version of PCL.<br><br>I installed ROS latest from SVN in Ubuntu and then I was following the tutorial <a href="http://www.ros.org/wiki/pcl/Tutorials/Downsampling%20a%20PointCloud%20using%20a%20VoxelGrid%20filter" target="_blank"><font size="2">Downsampling  a PointCloud using a VoxelGrid filter.</font></a> After adding the required lines in the pcl/CMakeLists.txt file in order to compile the example src/examples/filter_voxel_grid.cpp and launching make I obtained the following linking error:<br>

<br>Linking CXX executable ../bin/tutorial_filter_voxel_grid<br>CMakeFiles/tutorial_filter_voxel_grid.dir/src/examples/filter_voxel_grid.o: In function `Filter':<br>/home/jordi/ros/stacks/point_cloud_perception/pcl/include/pcl/filters/filter.h:401: undefined reference to `vtable for pcl::Filter<sensor_msgs::PointCloud2_<std::allocator<void> > >'<br>

/home/jordi/ros/stacks/point_cloud_perception/pcl/include/pcl/filters/filter.h:401: undefined reference to `vtable for pcl::Filter<sensor_msgs::PointCloud2_<std::allocator<void> > >'<br>CMakeFiles/tutorial_filter_voxel_grid.dir/src/examples/filter_voxel_grid.o: In function `VoxelGrid':<br>

/home/jordi/ros/stacks/point_cloud_perception/pcl/include/pcl/filters/voxel_grid.h:579: undefined reference to `vtable for pcl::VoxelGrid<sensor_msgs::PointCloud2_<std::allocator<void> > >'<br>/home/jordi/ros/stacks/point_cloud_perception/pcl/include/pcl/filters/voxel_grid.h:579: undefined reference to `vtable for pcl::VoxelGrid<sensor_msgs::PointCloud2_<std::allocator<void> > >'<br>

CMakeFiles/tutorial_filter_voxel_grid.dir/src/examples/filter_voxel_grid.o: In function `main':<br>/home/jordi/ros/stacks/point_cloud_perception/pcl/src/examples/filter_voxel_grid.cpp:65: undefined reference to `pcl::PCLBase<sensor_msgs::PointCloud2_<std::allocator<void> > >::setInputCloud(boost::shared_ptr<sensor_msgs::PointCloud2_<std::allocator<void> > const> const&)'<br>

/home/jordi/ros/stacks/point_cloud_perception/pcl/src/examples/filter_voxel_grid.cpp:67: undefined reference to `pcl::Filter<sensor_msgs::PointCloud2_<std::allocator<void> > >::filter(sensor_msgs::PointCloud2_<std::allocator<void> >&)'<br>

CMakeFiles/tutorial_filter_voxel_grid.dir/src/examples/filter_voxel_grid.o: In function `~VoxelGrid':<br>/home/jordi/ros/stacks/point_cloud_perception/pcl/include/pcl/filters/voxel_grid.h:571: undefined reference to `vtable for pcl::VoxelGrid<sensor_msgs::PointCloud2_<std::allocator<void> > >'<br>

/home/jordi/ros/stacks/point_cloud_perception/pcl/include/pcl/filters/voxel_grid.h:571: undefined reference to `vtable for pcl::VoxelGrid<sensor_msgs::PointCloud2_<std::allocator<void> > >'<br>CMakeFiles/tutorial_filter_voxel_grid.dir/src/examples/filter_voxel_grid.o: In function `~Filter':<br>

/home/jordi/ros/stacks/point_cloud_perception/pcl/include/pcl/filters/filter.h:405: undefined reference to `vtable for pcl::Filter<sensor_msgs::PointCloud2_<std::allocator<void> > >'<br>/home/jordi/ros/stacks/point_cloud_perception/pcl/include/pcl/filters/filter.h:405: undefined reference to `vtable for pcl::Filter<sensor_msgs::PointCloud2_<std::allocator<void> > >'<br>

/home/jordi/ros/stacks/point_cloud_perception/pcl/include/pcl/filters/filter.h:405: undefined reference to `vtable for pcl::Filter<sensor_msgs::PointCloud2_<std::allocator<void> > >'<br>/home/jordi/ros/stacks/point_cloud_perception/pcl/include/pcl/filters/filter.h:405: undefined reference to `vtable for pcl::Filter<sensor_msgs::PointCloud2_<std::allocator<void> > >'<br>

CMakeFiles/tutorial_filter_voxel_grid.dir/src/examples/filter_voxel_grid.o: In function `~VoxelGrid':<br>/home/jordi/ros/stacks/point_cloud_perception/pcl/include/pcl/filters/voxel_grid.h:571: undefined reference to `vtable for pcl::VoxelGrid<sensor_msgs::PointCloud2_<std::allocator<void> > >'<br>

/home/jordi/ros/stacks/point_cloud_perception/pcl/include/pcl/filters/voxel_grid.h:571: undefined reference to `vtable for pcl::VoxelGrid<sensor_msgs::PointCloud2_<std::allocator<void> > >'<br>CMakeFiles/tutorial_filter_voxel_grid.dir/src/examples/filter_voxel_grid.o: In function `~Filter':<br>

/home/jordi/ros/stacks/point_cloud_perception/pcl/include/pcl/filters/filter.h:405: undefined reference to `vtable for pcl::Filter<sensor_msgs::PointCloud2_<std::allocator<void> > >'<br>/home/jordi/ros/stacks/point_cloud_perception/pcl/include/pcl/filters/filter.h:405: undefined reference to `vtable for pcl::Filter<sensor_msgs::PointCloud2_<std::allocator<void> > >'<br>

collect2: ld returned 1 exit status<br>make[3]: *** [../bin/tutorial_filter_voxel_grid] Error 1<br>make[3]: Leaving directory `/home/jordi/ros/stacks/point_cloud_perception/pcl/build'<br>make[2]: *** [CMakeFiles/tutorial_filter_voxel_grid.dir/all] Error 2<br>

make[2]: Leaving directory `/home/jordi/ros/stacks/point_cloud_perception/pcl/build'<br>make[1]: *** [all] Error 2<br>make[1]: Leaving directory `/home/jordi/ros/stacks/point_cloud_perception/pcl/build'<br>make: *** [all] Error 2<br>

<br clear="all">Is there any dependency missing?<br><br>Thanks in advance<br><br>-- <br>Jordi Pages, PhD<br>Researcher<br>Pal Robotics S.L.<br><br>Tel: +34.93.414.53.47<br>Fax: +34.93.209.11.09<br>C/ Pujades 77-79 4º 4ª 08005 Barcelona, Spain.<br>

<a href="http://www.pal-robotics.com/" target="_blank">http://www.pal-robotics.com/</a><br><br>AVISO DE CONFIDENCIALIDAD: Este mensaje y sus documentos adjuntos, pueden contener información privilegiada y/o confidencial que está dirigida exclusivamente a su destinatario.<br>

Si usted recibe este mensaje y no es el destinatario indicado, o el empleado encargado de su entrega a dicha persona, por favor, notifíquelo inmediatamente y remita el mensaje original a la dirección<br>de correo electrónico indicada. Cualquier copia, uso o distribución no autorizados de esta comunicación queda estrictamente prohibida.<br>

<br>CONFIDENTIALITY NOTICE: This e-mail and the accompanying document(s) may contain confidential information which is privileged and intended only for the individual or entity to whom they are addressed.  If you are not the intended recipient, you are hereby notified that any disclosure, copying, distribution or use of this e-mail and/or accompanying document(s) is strictly prohibited.  If you have received this e-mail in error, please immediately notify the sender at the above e-mail address.<br>

<br>
</blockquote></div><br><br clear="all"><br>-- <br>Jordi Pages, PhD<br>Researcher<br>Pal Robotics S.L.<br><br>Tel: +34.93.414.53.47<br>Fax: +34.93.209.11.09<br>C/ Pujades 77-79 4º 4ª 08005 Barcelona, Spain.<br><a href="http://www.pal-robotics.com/">http://www.pal-robotics.com/</a><br>
<br>AVISO DE CONFIDENCIALIDAD: Este mensaje y sus documentos adjuntos, pueden contener información privilegiada y/o confidencial que está dirigida exclusivamente a su destinatario.<br>Si usted recibe este mensaje y no es el destinatario indicado, o el empleado encargado de su entrega a dicha persona, por favor, notifíquelo inmediatamente y remita el mensaje original a la dirección<br>
de correo electrónico indicada. Cualquier copia, uso o distribución no autorizados de esta comunicación queda estrictamente prohibida.<br><br>CONFIDENTIALITY NOTICE: This e-mail and the accompanying document(s) may contain confidential information which is privileged and intended only for the individual or entity to whom they are addressed.  If you are not the intended recipient, you are hereby notified that any disclosure, copying, distribution or use of this e-mail and/or accompanying document(s) is strictly prohibited.  If you have received this e-mail in error, please immediately notify the sender at the above e-mail address.<br>
<br>