[ros-users] Linking problems with pcl

Lorenz Mösenlechner moesenle at in.tum.de
Tue Sep 21 20:56:18 UTC 2010


Hi,

your error might have something to do with a recent change in
eigen3. We renamed the namespace Eigen to Eigen3 to prevent conflicts
in packages that depend on eigen and eigen3. Which version of the
point_cloud_perception stack are you using and how current is it?

Lorenz

> Hi everybody,
> 
> I get this error:
> CMakeFiles/geometry_based_obstacle_detector.dir/src/geometry_based_obstacle_detector.o: In function `cloudCallback(boost::shared_ptr<sensor_msgs::PointCloud2_<std::allocator<void> > const>  
> const&)':
> /home/skliegl/GETbot/svn/ros/pcl_tools/src/geometry_based_obstacle_detector.cpp:19: undefined reference to `pcl::getPointCloudAsEigen(sensor_msgs::PointCloud2_<std::allocator<void> > const&, Eigen3::Matrix<float, -1, -1, 0, -1,  
> -1>&)'
> 
> The mentioned function is:
> void cloudCallback(const sensor_msgs::PointCloud2ConstPtr& cloud)
> {
> 	Eigen3::MatrixXf points;
> 	pcl::getPointCloudAsEigen (*cloud, points);
> 
> }
> 
> The corresponding part of the CMakeLists.txt:
> rosbuild_add_executable( geometry_based_obstacle_detector  
> src/geometry_based_obstacle_detector.cpp)
> target_link_libraries(geometry_based_obstacle_detector pcl_io)
> 
> Any ideas?
> 
> Thank you,
> Sabrina
> 
> 
> _______________________________________________
> ros-users mailing list
> ros-users at code.ros.org
> https://code.ros.org/mailman/listinfo/ros-users
> 

-- 
Lorenz Mösenlechner            | moesenle at in.tum.de
Technische Universität München | Boltzmannstr. 3
85748 Garching bei München     | Germany
http://ias.cs.tum.edu/         | Tel: +49 (89) 289-26910



More information about the ros-users mailing list