[ros-users] pcl_ros compilation error

Nathaniel Robert Lewis linux.robotdude at gmail.com
Thu Dec 23 16:32:19 UTC 2010


I am having some problems with pcl_ros.  I keep getting this error while
compiling: 

[rosmake-0] Starting >>> pcl_ros
[ make ]                                                                                                     
[ rosmake ] Last 40 linesl_ros: 55.5 sec ]
[ 1 Active 39/40 Complete ]
{-------------------------------------------------------------------------------
  make[3]: Entering directory
`/ros/stacks/point_cloud_perception/pcl_ros/build'
  Scanning dependencies of target rospack_gencfg_real
  make[3]: Leaving directory
`/ros/stacks/point_cloud_perception/pcl_ros/build'
  Scanning dependencies of target rosbuild_precompile
  make[3]: Leaving directory
`/ros/stacks/point_cloud_perception/pcl_ros/build'
  [ 23%] Built target rospack_gencfg_real
  [ 23%] Built target rosbuild_precompile
  make[3]: Entering directory
`/ros/stacks/point_cloud_perception/pcl_ros/build'
  make[3]: Entering directory
`/ros/stacks/point_cloud_perception/pcl_ros/build'
  Scanning dependencies of target pcl_ros_filters
  make[3]: Leaving directory
`/ros/stacks/point_cloud_perception/pcl_ros/build'
  make[3]: Entering directory
`/ros/stacks/point_cloud_perception/pcl_ros/build'
  [ 26%] Building CXX object
CMakeFiles/pcl_ros_filters.dir/src/pcl_ros/filters/filter.o
  Scanning dependencies of target pcl_ros_features
  make[3]: Leaving directory
`/ros/stacks/point_cloud_perception/pcl_ros/build'
  make[3]: Entering directory
`/ros/stacks/point_cloud_perception/pcl_ros/build'
  [ 28%] Building CXX object
CMakeFiles/pcl_ros_features.dir/src/pcl_ros/features/feature.o
  /ros/stacks/point_cloud_perception/pcl_ros/src/pcl_ros/features/feature.cpp: In member function ‘void pcl_ros::Feature::input_surface_indices_callback(const boost::shared_ptr<const sensor_msgs::PointCloud2_<std::allocator<void> > >&, const boost::shared_ptr<const sensor_msgs::PointCloud2_<std::allocator<void> > >&, const pcl::PointIndicesConstPtr&)’:
  /ros/stacks/point_cloud_perception/pcl_ros/src/pcl_ros/features/feature.cpp:249: error: ‘struct pcl::PointCloud<pcl::PointXYZ>’ has no member named ‘makeShared’
  /ros/stacks/point_cloud_perception/pcl_ros/src/pcl_ros/features/feature.cpp:256: error: ‘struct pcl::PointCloud<pcl::PointXYZ>’ has no member named ‘makeShared’
  /ros/stacks/point_cloud_perception/pcl_ros/src/pcl_ros/features/feature.cpp: In member function ‘void pcl_ros::FeatureFromNormals::input_normals_surface_indices_callback(const boost::shared_ptr<const sensor_msgs::PointCloud2_<std::allocator<void> > >&, const boost::shared_ptr<const sensor_msgs::PointCloud2_<std::allocator<void> > >&, const boost::shared_ptr<const sensor_msgs::PointCloud2_<std::allocator<void> > >&, const pcl::PointIndicesConstPtr&)’:
  /ros/stacks/point_cloud_perception/pcl_ros/src/pcl_ros/features/feature.cpp:476: error: ‘struct pcl::PointCloud<pcl::PointXYZ>’ has no member named ‘makeShared’
  /ros/stacks/point_cloud_perception/pcl_ros/src/pcl_ros/features/feature.cpp:480: error: ‘struct pcl::PointCloud<pcl::Normal>’ has no member named ‘makeShared’
  /ros/stacks/point_cloud_perception/pcl_ros/src/pcl_ros/features/feature.cpp:487: error: ‘struct pcl::PointCloud<pcl::PointXYZ>’ has no member named ‘makeShared’
  make[3]: ***
[CMakeFiles/pcl_ros_features.dir/src/pcl_ros/features/feature.o] Error 1
  make[3]: Leaving directory
`/ros/stacks/point_cloud_perception/pcl_ros/build'
  make[2]: *** [CMakeFiles/pcl_ros_features.dir/all] Error 2
  make[2]: *** Waiting for unfinished jobs....
  [ 30%] Building CXX object
CMakeFiles/pcl_ros_filters.dir/src/pcl_ros/filters/passthrough.o
  /ros/stacks/point_cloud_perception/pcl_ros/src/pcl_ros/filters/passthrough.cpp: In member function ‘virtual void pcl_ros::PassThrough::config_callback(pcl_ros::FilterConfig&, uint32_t)’:
  /ros/stacks/point_cloud_perception/pcl_ros/src/pcl_ros/filters/passthrough.cpp:88: error: no matching function for call to ‘pcl::PassThrough<sensor_msgs::PointCloud2_<std::allocator<void> > >::getFilterLimitsNegative()’
  /ros/stacks/point_cloud_perception/pcl/include/pcl/filters/filter.h:244: note: candidates are: void pcl::Filter<sensor_msgs::PointCloud2_<std::allocator<void> > >::getFilterLimitsNegative(bool&)
  make[3]: ***
[CMakeFiles/pcl_ros_filters.dir/src/pcl_ros/filters/passthrough.o] Error
1
  make[3]: *** Waiting for unfinished jobs....
  make[3]: Leaving directory
`/ros/stacks/point_cloud_perception/pcl_ros/build'
  make[2]: *** [CMakeFiles/pcl_ros_filters.dir/all] Error 2
  make[2]: Leaving directory
`/ros/stacks/point_cloud_perception/pcl_ros/build'
  make[1]: *** [all] Error 2
  make[1]: Leaving directory
`/ros/stacks/point_cloud_perception/pcl_ros/build'
-------------------------------------------------------------------------------}
[ rosmake ] Output from build of package pcl_ros written to:
[ rosmake ]    /home/teknoman117/.ros/rosmake/rosmake_output-20101223-082257/pcl_ros/build_output.log
[rosmake-0] Finished <<< pcl_ros [FAIL] [ 55.56
seconds ]                                                                                     
[ rosmake ] Halting due to failure in package pcl_ros. 
[ rosmake ] Waiting for other threads to
complete.                                    
[ rosmake ]
Results:                                                                                                                          
[ rosmake ] Built 40 packages with 1
failures.                                                                                                
[ rosmake ] Summary output to
directory                                                                                                       
[ rosmake ] /home/teknoman117/.ros/rosmake/rosmake_output-20101223-082257                                                                     
teknoman117 at WishMac:/ros/stacks/point_cloud_perception$ 

The first time I got more errors so I went and update to the most recent
svn version, 34989, and got the errors listed above.  It seems that the
structure pcl::PointCloud is missing a member called "makeShared".

Nathaniel

-------------- next part --------------
An HTML attachment was scrubbed...
URL: <http://lists.osuosl.org/pipermail/ros-users/attachments/20101223/a345fd53/attachment-0002.html>


More information about the ros-users mailing list