Symbol lookup error when using stomp_moveit.
One more symbol lookup question for ros answers.
I run the example for panda robot and STOMP planner from this page. However instead of planned paths I get the annoying error:
/opt/ros/melodic/lib/moveit_ros_move_group/move_group: symbol lookup error: /home/yuriy/Documents/Projects/ROS/ros_arm_workspace/devel/lib/libstomp_moveit_noisy_filters.so: undefined symbol: _ZN2tf15pointEigenToMsgERKN5Eigen6MatrixIdLi3ELi1ELi0ELi3ELi1EEERN13geometry_msgs6Point_ISaIvEEE
Error occurs whenever I push Plan
button in RVIZ.
c++filt for this symbol produce the following output:
tf::pointEigenToMsg(Eigen::Matrix<double, 3, 1, 0, 3, 1> const&, geometry_msgs::Point_<std::allocator<void> >&)
stomp_core
and stomp_moveit
are built from sources using https://github.com/ros-industrial/ind... repo. It seems strange that error occurs inside stomp_moveit
package since tutorial clearly states
You only need to build the stomp_core package from industrial_moveit as other packages are not required for the functionality of STOMP with moveIt.
I use ubuntu 18.04 and melodic distribution.
P.S. I have tried to remove build
and devel
folders and rebuild the workspace. That does not help.
Hello,
I have the same problem/error while using STOMP. I also online installed the stomp_core package.
Did you find a solution for this error?
Thanks.
@DieterWuytens I have commented lines 85 and 250 in
stomp_moveit/src/noisy_filters/multi_trajectory_visualization.cpp
. It will break visualization if you use it but planner will work.