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

VinceDietrich's profile - activity

2015-06-25 05:45:16 -0500 commented answer How to setup Xtion Pro Live Ubuntu 14.04 openNI(1/2) ?

My 0600 xtion only works with openni2, but not with openni

2015-02-19 08:22:44 -0500 commented question rqt_graph crashes

I have the same problem. Restarting Ubuntu helps at first, but error came back. Installing ros-indigo-qt-gui-app and ros-indigo-qt-gui-core did not help for me so far.

ros-indigo-rqt-graph 0.3.10-0trusty-20141230-0525-+0000 amd64 ros-indigo-qt-dotgraph 0.2.26-0trusty-20141230-0049-+0000 amd64

2014-12-03 10:20:17 -0500 commented question Planning and moving PR2 base/whole robot with moveit

Thanks for your reply, the question is not relevant for me anymore, even though I did not find a solution for that specific issue. I will close it then.

2014-07-14 02:41:29 -0500 received badge  Popular Question (source)
2014-07-14 02:41:29 -0500 received badge  Notable Question (source)
2014-07-14 02:41:29 -0500 received badge  Famous Question (source)
2014-04-22 15:01:34 -0500 received badge  Enthusiast
2014-04-17 17:53:00 -0500 asked a question Planning and moving PR2 base/whole robot with moveit

Hey there,

I am new to ROS (using hydro) and trying to move the PR2 in Moveit.

I started the demo:

roslaunch pr2_moveit_config demo.launch

And then used the following commands in a python script (oriented on the pr2 moveit tutorial):

moveit_commander.roscpp_initialize(sys.argv)
rospy.init_node('robotcontrol', anonymous=False)

# MOVEIT COMMANDER

robot = moveit_commander.RobotCommander()
scene = moveit_commander.PlanningSceneInterface()
group2 = moveit_commander.MoveGroupCommander("base")          

pose_base = geometry_msgs.msg.Pose()
pose_base.orientation.w = 1.0
pose_base.position.x = -1
pose_base.position.y = -0.5
pose_base.position.z = 0

# Base Does not have any end effector
end_eff = group2.get_end_effector_link()
print("\nend effector:\n")
print(end_eff)
print("\n")

# Does not receive any pose as there is no end effector
#group2.set_pose_target(pose_base)

# So try it with a random joint target
group2.set_random_target()

p = group2.plan()

if not p.joint_trajectory.points:
    print('no plan!')
else:
    group2.execute(p)

But the robot does not move in RVIZ. Anybody an idea how I can plan and execute a movement of the whole robot base? Unfortunately I am not able to use Gazebo due to my computer and graphics card.

Thanks a lot,

Vincent