Moveit Commander throwing terminate error with boost #331
Closed
Description
Description
I am trying to create a program that uses moveit commander and I get the following error when I try to run it.
terminate called after throwing an instance of 'boost::exception_detail::clone_impl<boost::exception_detail::error_info_injectorboost::lock_error >'
what(): boost: mutex lock failed in pthread_mutex_lock: Invalid argument
Aborted (core dumped)
My code is only the python shebang and imports as follows:
#!/usr/bin/env python
import rospy
import geometry_msgs.msg
import moveit_commander
Your environment
- ROS Distro: Indigo
- OS Version: e.g. Ubuntu 14.04
- Source or Binary build? Latest binary
Metadata
Assignees
Labels
No labels
Activity