[ros-users] VSLAM compilation error

Tully Foote tfoote at willowgarage.com
Wed Feb 16 05:38:18 UTC 2011


Hi Prasad,

We're switching troubleshooting questions to http://answers.ros.org  please
ask your question there.  I suggest tags vslam eigen and compile_error

Tully

On Tue, Feb 15, 2011 at 9:23 PM, Prasad Dixit <abhimohpra at gmail.com> wrote:

>
> Hello,
>
>  I am trying to compile vslam as instructed but halting at some error
> mentioned below:
>
> Is there anything that i am suppose to make link to eigen3 externally?
>
> [rosmake-3] Finished <<< rosnode ROS_NOBUILD in package rosnode
> [rosmake-3] Starting >>> image_transport [ make ]
> [rosmake-3] Finished <<< image_transport ROS_NOBUILD in package
> image_transport
> [rosmake-3] Starting >>> cv_bridge [ make ]
> [rosmake-3] Finished <<< cv_bridge ROS_NOBUILD in package cv_bridge
> [rosmake-3] Starting >>> image_geometry [ make ]
> [rosmake-3] Finished <<< image_geometry ROS_NOBUILD in package
> image_geometry
> [rosmake-3] Starting >>> rosmsg [ make ]
> [rosmake-3] Finished <<< rosmsg ROS_NOBUILD in package rosmsg
>  No Makefile in package rosmsg
> [rosmake-3] Starting >>> rosservice [ make ]
> [rosmake-3] Finished <<< rosservice ROS_NOBUILD in package rosservice
> [rosmake-3] Starting >>> roswtf [ make ]
> [rosmake-3] Finished <<< roswtf ROS_NOBUILD in package roswtf
> [rosmake-3] Starting >>> tf [ make ]
> [rosmake-3] Finished <<< tf ROS_NOBUILD in package tf
> [rosmake-3] Starting >>> nav_msgs [ make ]
> [rosmake-3] Finished <<< nav_msgs ROS_NOBUILD in package nav_msgs
> [rosmake-3] Starting >>> dynamic_reconfigure [ make ]
> [rosmake-3] Finished <<< dynamic_reconfigure ROS_NOBUILD in package
> dynamic_reconfigure
> [rosmake-3] Starting >>> stereo_msgs [ make ]
> [rosmake-3] Finished <<< stereo_msgs ROS_NOBUILD in package stereo_msgs
> [rosmake-2] Finished <<< bpcg [PASS] [ 1.40 seconds ]
> [rosmake-1] Finished <<< vocabulary_tree [PASS] [ 1.51 seconds ]
> [ rosmake ] Last 40 linesame_common: 3.5 sec ]
> [ 1 Active 51/54 Complete ]
>
> {-------------------------------------------------------------------------------
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/SelfAdjointView.h:206:
> error: ‘SelfAdjoint’ was not declared in this scope
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/SelfAdjointView.h:206:
> error: ‘Upper’ was not declared in this scope
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/SelfAdjointView.h:206:
> error: template argument 3 is invalid
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/SelfAdjointView.h:212:
> error: ‘SelfAdjoint’ was not declared in this scope
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/SelfAdjointView.h:212:
> error: ‘Lower’ was not declared in this scope
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/SelfAdjointView.h:212:
> error: template argument 3 is invalid
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/SelfAdjointView.h:231:
> error: ‘SelfAdjoint’ was not declared in this scope
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/SelfAdjointView.h:231:
> error: ‘Lower’ was not declared in this scope
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/SelfAdjointView.h:231:
> error: template argument 3 is invalid
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/SelfAdjointView.h:237:
> error: ‘SelfAdjoint’ was not declared in this scope
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/SelfAdjointView.h:237:
> error: ‘Upper’ was not declared in this scope
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/SelfAdjointView.h:237:
> error: ‘Dynamic’ was not declared in this scope
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/SelfAdjointView.h:237:
> error: template argument 3 is invalid
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/SelfAdjointView.h:237:
> error: template argument 4 is invalid
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/SelfAdjointView.h:255:
> error: ‘SelfAdjoint’ was not declared in this scope
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/SelfAdjointView.h:255:
> error: ‘Lower’ was not declared in this scope
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/SelfAdjointView.h:255:
> error: ‘Dynamic’ was not declared in this scope
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/SelfAdjointView.h:255:
> error: template argument 3 is invalid
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/SelfAdjointView.h:255:
> error: template argument 4 is invalid
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/SelfAdjointView.h:278:
> error: no ‘const Eigen3::SelfAdjointView<Derived, UpLo>
> Eigen3::MatrixBase<Derived>::selfadjointView() const’ member function
> declared in class ‘Eigen3::MatrixBase<Derived>’
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/SelfAdjointView.h:285:
> error: no ‘Eigen3::SelfAdjointView<Derived, UpLo>
> Eigen3::MatrixBase<Derived>::selfadjointView()’ member function declared in
> class ‘Eigen3::MatrixBase<Derived>’
>  In file included from
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/Core:306,
>                   from
>
> /opt/ros/cturtle/stacks/point_cloud_perception/pcl/include/pcl/pcl_base.h:42,
>                   from
>
> /opt/ros/cturtle/stacks/point_cloud_perception/pcl/include/pcl/common/common.h:41,
>                   from
> /opt/ros/cturtle/stacks/vslam/frame_common/include/frame_common/frame.h:56,
>                   from
> /opt/ros/cturtle/stacks/vslam/frame_common/src/draw.cpp:40:
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/products/Parallelizer.h:29:
> error: variable or field ‘ei_manage_multi_threading’ declared void
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/products/Parallelizer.h:29:
> error: ‘Action’ was not declared in this scope
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/products/Parallelizer.h:29:
> error: expected primary-expression before ‘int’
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/products/Parallelizer.h:128:
> error: expected ‘}’ before end of line
>
>
> /opt/ros/cturtle/stacks/geometry_experimental/eigen3/include/Eigen3/src/Core/products/Parallelizer.h:128:
> error: expected declaration before end of line
>  make[3]: *** [CMakeFiles/frame_common.dir/src/frame.o] Error 1
>  make[3]: *** Waiting for unfinished jobs....
>  make[3]: *** [CMakeFiles/frame_common.dir/src/draw.o] Error 1
>  make[3]: Leaving directory
> `/opt/ros/cturtle/stacks/vslam/frame_common/build'
>  make[2]: *** [CMakeFiles/frame_common.dir/all] Error 2
>  make[2]: Leaving directory
> `/opt/ros/cturtle/stacks/vslam/frame_common/build'
>  make[1]: *** [all] Error 2
>  make[1]: Leaving directory
> `/opt/ros/cturtle/stacks/vslam/frame_common/build'
>
> -------------------------------------------------------------------------------}
> [ rosmake ] Output from build of package frame_common written to:
> [ rosmake ]
>
> /home/rootx/.ros/rosmake/rosmake_output-20110216-104646/frame_common/build_output.log
> [rosmake-0] Finished <<< frame_common [FAIL] [ 3.52 seconds ]
> [ rosmake ] Halting due to failure in package frame_common.
> [ rosmake ] Waiting for other threads to complete.
> [ rosmake ] Results:
> [ rosmake ] Built 52 packages with 1 failures.
> [ rosmake ] Summary output to directory
> [ rosmake ] /home/rootx/.ros/rosmake/rosmake_output-20110216-104646
>
> Any help appreciated.
>
> Prasad
> --
> View this message in context:
> http://ros-users.122217.n3.nabble.com/VSLAM-compilation-error-tp2507058p2507058.html
> Sent from the ROS-Users mailing list archive at Nabble.com.
> _______________________________________________
> ros-users mailing list
> ros-users at code.ros.org
> https://code.ros.org/mailman/listinfo/ros-users
>



-- 
Tully Foote
Systems Engineer
Willow Garage, Inc.
tfoote at willowgarage.com
(650) 475-2827
-------------- next part --------------
An HTML attachment was scrubbed...
URL: <http://lists.ros.org/pipermail/ros-users/attachments/20110215/ced0aa80/attachment-0003.html>


More information about the ros-users mailing list