Git Product home page Git Product logo

sawyer_moveit's Introduction

Sawyer MoveIt

The Sawyer MoveIt repo is intended as an interface to the MoveIt motion planning library for enabling the development of complex 7-DOF trajectory generation.

This repository contains the packages for installation/use of the Sawyer Robot in MoveIt.

Installation

Please follow the Getting Started wiki page for instructions on installation of the Intera SDK: http://sdk.rethinkrobotics.com/intera/Workstation_Setup
Then please follow the MoveIt Tutorial wiki page for instructions on getting started with MoveIt: http://sdk.rethinkrobotics.com/intera/MoveIt_Tutorial

Code & Tickets

Documentation http://sdk.rethinkrobotics.com/intera/
Issues https://github.com/RethinkRobotics/sawyer_moveit/issues
Contributions https://github.com/RethinkRobotics/sawyer_moveit/blob/master/CONTRIBUTING.md

Sawyer Repository Overview

.
|
+-- sawyer_moveit/             Sawyer MoveIt metapackage containing all Sawyer-specific packages
|
+-- sawyer_moveit.rosinstall   rosinstall script containing all required Sawyer dependency repos
|
+-- sawyer_moveit_config/      Custom MoveIt pacakge with config, launch, and srdf files for sawyer

Other Sawyer Repositories

intera_sdk https://github.com/RethinkRobotics/intera_sdk
intera_commom https://github.com/RethinkRobotics/intera_common
sawyer_robot https://github.com/RethinkRobotics/sawyer_robot

Latest Release Information

http://sdk.rethinkrobotics.com/intera/Release-Changes

sawyer_moveit's People

Contributors

iantheengineer avatar rethink-rlinsalata avatar shiweiwang avatar

Stargazers

 avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar

Watchers

 avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar

sawyer_moveit's Issues

Motion plans fail on non-default planers

In the Context panel, when selecting any planner other than default.

[ INFO] [1478272079.499072664]: Planning request received for MoveGroup action. Forwarding to planning pipeline.
[ INFO] [1478272079.500586737]: Planner configuration 'right_arm[LBKPIECEkConfigDefault]' will use planner 'geometric::LBKPIECE'. Additional configuration parameters will be set when the planner is constructed.
[ INFO] [1478272079.501569647]: right_arm[LBKPIECEkConfigDefault]: Attempting to use default projection.
[ERROR] [1478272079.501759871]: No default projection is set. Perhaps setup() needs to be called
[ERROR] [1478272079.503726730]: OMPL encountered an error: No projection evaluator specified
[ WARN] [1478272079.510240936]: Fail: ABORTED: Catastrophic failure

moveit execution fails on real robot

I am using Ubuntu 16.04 and ros kinetic. I am able to move the sawyer with the intera sdk examples, but when I use the execute button after it has created a plan in the rviz gui it fails with this message:

[ WARN] [1505497768.668273664]: Failed to validate trajectory: couldn't receive full current joint state within 1s
[ INFO] [1505497768.668366775]: Execution completed: ABORTED

I double checked and the robot is enabled and the joint_trajectory_action_server is also running. Does anyone know why this won't execute on the real robot?

Robot Description Loading

I know this repo is dead, but in case anyone else runs into this issue:

Inside planning_context.launch, when load_robot_description is set to true, it attempts to load a nonexistent urdf file into the robot_description parameter.

A fix for this should be:

<param if="$(arg load_robot_description)" name="$(arg robot_description)" 
  command="$(find xacro)/xacro '$(find sawyer_description)/urdf/sawyer.urdf.xacro'
      electric_gripper:=$(arg electric_gripper)"/>

robot position and joint angles does not get updated

Hi,

I'm using (group =) moveit_commander.MoveGroupCommander("right_arm") to get the group. I'm able to access the group. But when I do group.get_current_joint_values() , I get all the values equal to zero, irrespective of the configuration of the robot. Also when I try to do group.get_current_pose().pose, I get the pose corresponding to the zero joint angles in any configuration of the arm. But the rviz moveit visualizer is working fine ( it is showing the present configuration of the robot).

Can you guide me how to resolve this issue?

Deprecation Warnings on MoveIt launch

There are two sets of warning that now show up when starting roslaunch sawyer_moveit_config sawyer_moveit.launch:

  • Trajectory Parameters
[ WARN] [1478272020.526312660]: 
Deprecation warning: parameter 'allowed_execution_duration_scaling' moved into namespace 'trajectory_execution'.
Please, adjust file trajectory_execution.launch.xml!
[ WARN] [1478272020.529095252]: 
Deprecation warning: parameter 'allowed_goal_duration_margin' moved into namespace 'trajectory_execution'.
Please, adjust file trajectory_execution.launch.xml!

and

  • move_group Trajectory Action
[ WARN] [1478272026.036739941]: 
Deprecation warning: Trajectory execution service is deprecated (was replaced by an action).
Replace 'MoveGroupExecuteService' with 'MoveGroupExecuteTrajectoryAction' in move_group.launch

and

  • xacro.py deprecation
xacro.py is deprecated; please use xacro instead

No known controllers

When using rviz to plan and execute a trajectory, planning goes well but executing the path fails with this error:
[ERROR] [1519413877.822655341]: Unable to identify any set of controllers that can actuate the specified joints: [ right_j0 right_j1 right_j2 right_j3 right_j4 right_j5 right_j6 ] [ERROR] [1519413877.822726115]: Known controllers and their joints:

All Moveit! packages are installed and our Sawyer is running on release-5.2.0

When launching sawyer_moveit.launch this shows up:
[ERROR] [1519414365.681661603]: Action client not connected: /robot/limb/right/follow_joint_trajectory
but everything else goes well and I am able to plan.

I looked into the joints available in rviz but the joints there are named something like 'right_l0' instead of the expected names in sawyer_controllers.yaml

sawyer can't execute planning trajectory

When i use "roslaunch sawyer_moveit_config sawyer_moveit.launch electric_grippe" and plan a feasible trajectory, but it failed to executed with the following warn:
[ INFO] [1616054616.353942433]: Execution request received
[ INFO] [1616054617.354446093]: Didn't received robot state (joint angles) with recent timestamp within 1 seconds.
Check clock synchronization if your are running ROS across multiple machines!
[ WARN] [1616054617.354575457]: Failed to validate trajectory: couldn't receive full current joint state within 1s
[ INFO] [1616054617.354697942]: Execution completed: ABORTED
[ INFO] [1616054617.367115973]: ABORTED: Solution found but controller failed during execution

Add temporary electric gripper collision shapes.

The electric gripper articulated mesh, and its joint states are not currently available from the robot. We need a different (temporary) set of collision shapes just for the electric gripper.

Recommend Projects

  • React photo React

    A declarative, efficient, and flexible JavaScript library for building user interfaces.

  • Vue.js photo Vue.js

    ๐Ÿ–– Vue.js is a progressive, incrementally-adoptable JavaScript framework for building UI on the web.

  • Typescript photo Typescript

    TypeScript is a superset of JavaScript that compiles to clean JavaScript output.

  • TensorFlow photo TensorFlow

    An Open Source Machine Learning Framework for Everyone

  • Django photo Django

    The Web framework for perfectionists with deadlines.

  • D3 photo D3

    Bring data to life with SVG, Canvas and HTML. ๐Ÿ“Š๐Ÿ“ˆ๐ŸŽ‰

Recommend Topics

  • javascript

    JavaScript (JS) is a lightweight interpreted programming language with first-class functions.

  • web

    Some thing interesting about web. New door for the world.

  • server

    A server is a program made to process requests and deliver data to clients.

  • Machine learning

    Machine learning is a way of modeling and interpreting data that allows a piece of software to respond intelligently.

  • Game

    Some thing interesting about game, make everyone happy.

Recommend Org

  • Facebook photo Facebook

    We are working to build community through open source technology. NB: members must have two-factor auth.

  • Microsoft photo Microsoft

    Open source projects and samples from Microsoft.

  • Google photo Google

    Google โค๏ธ Open Source for everyone.

  • D3 photo D3

    Data-Driven Documents codes.