Error when planning with Moveit! Husky UR5 arm

asked 2016-04-05 00:49:06 -0500

Hi,

I followed this tutorial to use the Husky with the UR5 using Moveit!. Everything works ok so far. Now I want to use Moveit! to load motion planners at runtime. I created a new package to create a new node that will be in charge of execute the planning. This is my code:

#include <ros/ros.h>
#include <moveit/move_group_interface/move_group.h>

int main(int argc, char **argv)
{
  ros::init(argc, argv, "lesson_moveit");
  moveit::planning_interface::MoveGroup group("manipulator");

  // start a background "spinner", so our node can process ROS messages
  //  - this lets us know when the move is completed
  ros::AsyncSpinner spinner(1);
  spinner.start();

  // INSERT MOTION COMMANDS HERE
}

I got the following errors when trying to run the node:

andrestoga@andrestoga-RoboLab:~/ros_motion_planning$ rosrun project2 ur5_mover 
[ERROR] [1459832675.112257416]: Semantic description is not specified for the same robot as the URDF
[ERROR] [1459832675.112361080]: Link 'base_laser' is not known to URDF. Cannot disable collisons.
[ERROR] [1459832675.112377176]: Link 'base_laser' is not known to URDF. Cannot disable collisons.
[ERROR] [1459832675.112388309]: Link 'base_laser' is not known to URDF. Cannot disable collisons.
[ERROR] [1459832675.112399055]: Link 'base_laser' is not known to URDF. Cannot disable collisons.
[ERROR] [1459832675.112419331]: Link 'base_laser' is not known to URDF. Cannot disable collisons.
[ERROR] [1459832675.112430294]: Link 'base_laser' is not known to URDF. Cannot disable collisons.
[ INFO] [1459832675.112529966]: Loading robot model 'husky_robot_gazebo'...
[ INFO] [1459832675.112553399]: No root joint specified. Assuming fixed joint
[ERROR] [1459832675.279646657]: Error retrieving file [file:///opt/ros/indigo/share/ur_description/meshes/ur5/collision/upperarm.stl]: Couldn't open file /opt/ros/indigo/share/ur_description/meshes/ur5/collision/upperarm.stl
[ERROR] [1459832675.297248854]: Error retrieving file [file:///opt/ros/indigo/share/ur_description/meshes/ur5/visual/upperarm.dae]: Couldn't open file /opt/ros/indigo/share/ur_description/meshes/ur5/visual/upperarm.dae
[ERROR] [1459832675.333689794, 4214.540000000]: Error retrieving file [file:///opt/ros/indigo/share/ur_description/meshes/ur5/collision/wrist1.stl]: Couldn't open file /opt/ros/indigo/share/ur_description/meshes/ur5/collision/wrist1.stl
[ERROR] [1459832675.352395002, 4214.560000000]: Error retrieving file [file:///opt/ros/indigo/share/ur_description/meshes/ur5/visual/wrist1.dae]: Couldn't open file /opt/ros/indigo/share/ur_description/meshes/ur5/visual/wrist1.dae
[ERROR] [1459832675.370355017, 4214.570000000]: Error retrieving file [file:///opt/ros/indigo/share/ur_description/meshes/ur5/collision/wrist2.stl]: Couldn't open file /opt/ros/indigo/share/ur_description/meshes/ur5/collision/wrist2.stl
[ERROR] [1459832675.388504851, 4214.590000000]: Error retrieving file [file:///opt/ros/indigo/share/ur_description/meshes/ur5/visual/wrist2.dae]: Couldn't open file /opt/ros/indigo/share/ur_description/meshes/ur5/visual/wrist2.dae
[ERROR] [1459832675.406530003, 4214.610000000]: Error retrieving file [file:///opt/ros/indigo/share/ur_description/meshes/ur5/collision/wrist3.stl]: Couldn't open file /opt/ros/indigo/share/ur_description/meshes/ur5/collision/wrist3.stl
[ERROR] [1459832675.424788651, 4214.630000000]: Error retrieving file [file:///opt/ros/indigo/share/ur_description/meshes/ur5/visual/wrist3.dae]: Couldn't open file /opt/ros/indigo/share/ur_description/meshes/ur5/visual/wrist3.dae
[ERROR] [1459832675.499274924, 4214 ...
(more)
edit retag flag offensive close merge delete