moveit / moveit_commander

THIS REPO HAS MOVED TO https://github.com/ros-planning/moveit
11 stars 42 forks source link

Segmentation fault on wrong or no robot model #32

Closed Timple closed 8 years ago

Timple commented 9 years ago

I am trying to follow the python tutorial, but this simple file already crashes:

#!/usr/bin/python
import sys
import copy
import rospy
import moveit_commander
import moveit_msgs.msg
import geometry_msgs.msg

print "============ Starting tutorial setup"
moveit_commander.roscpp_initialize(sys.argv)
rospy.init_node('move_group_python_interface_tutorial',
                anonymous=True)

robot = moveit_commander.RobotCommander()

And the result in a segmentation fault.

Here is a backtrace: http://pastebin.com/3bftAaaj

I am trying to get MoveIt to work with Amigo (https://github.com/tue-robotics/amigo_moveit_config). But I get the same error if I only have a roscore running. (No parameters loaded).

Timple commented 9 years ago

This issue can also be reproduced by starting only a roscore and then running the python file above.