Hi,
I'm trying to use the high level function pick() from move_group_interface::MoveGroup. The arm would not open the gripper and just move directly across the object. The problem is shown in the attachment problem-1.png and problem-2.png.
Here is my procedure:
1)Fill in the message moveit_msgs/CollisionObject and publish it to the topic, /collision_object.
The source code is
here.
The visualization of the planning scene is in the attachment planning_scene.png
2)Write a node that use the pick function provided by move_group_interface::MoveGroup.
The source code is
here.
3)Run the necessary launches and nodes.
roslaunch pr2_gazebo pr2_empty_world.launch
roslaunch pr2_moveit_config move_group.launch
rosrun rviz rviz
rosrun the node that publish the collision object.
rosrun the node that call the pick function.
My platform is Ubuntu 12.10 64bit, and ROS Groovy. All the ROS related packages are installed using apt-get.
How to solve the problem. If there is a detailed step by step tutorial, please show me. That would be really helpful and be greatly appreciated.
Thanks,
-Albert