ROS Resources: Documentation | Support | Discussion Forum | Index | Service Status | ros @ Robotics Stack Exchange
Ask Your Question
0

cannot import moveit_commander

asked 2016-08-04 13:31:18 -0500

nio4990 gravatar image

hi,

i tried to run this code

import sys
import copy
import rospy
import moveit_commander
import moveit_msgs.msg
import geometry_msgs.msg

and got this error message:

Traceback (most recent call last):
  File "/home/anthonio/kuka_bot/src/agilus/src/testing.py", line 6, in <module>
    import moveit_commander
  File "/home/anthonio/moveit/devel/lib/python2.7/dist-packages/moveit_commander/__init__.py", line 35, in <module>
    exec(__fh.read())
  File "<string>", line 3, in <module>
  File "/home/anthonio/moveit/src/moveit_commander/src/moveit_commander/planning_scene_interface.py", line 48, in <module>
    import pyassimp
  File "/usr/lib/python2.7/dist-packages/pyassimp/__init__.py", line 1, in <module>


    from .core import *
  File "/usr/lib/python2.7/dist-packages/pyassimp/core.py", line 23, in <module>
    from . import structs

can someone please help me?

edit retag flag offensive close merge delete

2 Answers

Sort by ยป oldest newest most voted
0

answered 2016-08-08 02:01:32 -0500

tfoote gravatar image

The errors in your question look like a python2 / python3 compatibility issue. Though you did not copy and paste the actual error, only the traceback so it's hard to know for sure. releated debugging

edit flag offensive delete link more
0

answered 2016-08-05 07:45:47 -0500

nio4990 gravatar image

i reinstall my ubuntu 14.04 and reinstall ros + moveit, and still get the following error:

terminate called after throwing an instance of 'boost::exception_detail::clone_impl<boost::exception_detail::error_info_injector<boost::lock_error> >'
  what():  boost: mutex lock failed in pthread_mutex_lock: Invalid argument
Aborted (core dumped)
edit flag offensive delete link more

Comments

did you figure out the error? could you fix this?

robot_commander gravatar image robot_commander  ( 2017-11-19 16:54:53 -0500 )edit

Question Tools

2 followers

Stats

Asked: 2016-08-04 13:31:18 -0500

Seen: 1,309 times

Last updated: Aug 08 '16