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

Segmentation fault at MoveIt python tutorial

asked 2015-05-14 08:39:58 -0500

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... ). But I get the same error if I only have a roscore running. (No parameters loaded).

edit retag flag offensive close merge delete

Comments

I am having the same issue.Are you able to resolve it?

prrraveen gravatar image prrraveen  ( 2015-07-25 02:50:37 -0500 )edit

Nope, nobody replied here, nor on the github issue I created :-(. Haven't found a solution yet.

Timple86 gravatar image Timple86  ( 2015-07-27 00:44:28 -0500 )edit

Me too! Did you find the solution for the issue?

gurusub90 gravatar image gurusub90  ( 2016-02-19 20:13:17 -0500 )edit

You have to go through the robot configuration for your specific robot. I have no idea why though!

gurusub90 gravatar image gurusub90  ( 2016-02-19 20:33:46 -0500 )edit

I did follow the robot configuration wizard for Amigo. Still same issue :(

Timple86 gravatar image Timple86  ( 2016-02-20 07:15:06 -0500 )edit

1 Answer

Sort by ยป oldest newest most voted
0

answered 2016-08-31 09:37:24 -0500

Kei Okada gravatar image

This issue has been discussed at https://github.com/ros-planning/movei...

edit flag offensive delete link more

Question Tools

1 follower

Stats

Asked: 2015-05-14 08:39:58 -0500

Seen: 627 times

Last updated: Aug 31 '16