|
pr2eus_moveit package from jsk_pr2eus repojsk_pr2eus pr2eus pr2eus_armnavigation pr2eus_impedance pr2eus_moveit pr2eus_openrave pr2eus_tutorials |
Package Summary
| Tags | No category tags. |
| Version | 0.3.14 |
| License | BSD |
| Build type | CATKIN |
| Use | RECOMMENDED |
Repository Summary
| Checkout URI | https://github.com/jsk-ros-pkg/jsk_pr2eus.git |
| VCS Type | git |
| VCS Version | master |
| Last Updated | 2019-04-27 |
| Dev Status | DEVELOPED |
| Released | RELEASED |
Package Description
Additional Links
Maintainers
- YoheiKakiuchi
Authors
- YoheiKakiuchi
pr2eus_moveit
This package contains euslisp interface file for using moveit
Setting Up
Check if pr2 robot with moveit is already running, if not, run gazebo and moveit by
$ roslaunch pr2eus_moveit test-pr2eus-moveit.test gui:=true
Run roseus, load required packages and setup robot-interface with moveit feature enabled.
(load "package://pr2eus/pr2-interface.l")
(load "package://pr2eus_moveit/euslisp/pr2eus-moveit.l")
(pr2-init)
(send *ri* :set-moveit-environment (instance pr2-moveit-environment :init))
Send collision-free angle-vector
To send collision-free angle-vector, run following command instead of normal :angle-vector
(send *ri* :angle-vector-motion-plan (send *pr2* :reset-pose) :move-arm :rarm :use-torso t)
Plan motions and execute
If you want to specify target enc-coords instead of angle-vector, use following command
(send *ri* :move-end-coords-plan (make-coords :pos #f(700 0 750)) :move-arm :larm :use-torso t)
Use MoveIt IK service
If you want to use IK service provided by MoveIt, try
(setq av (send *ri* :collision-aware-ik (make-coords :pos #f(700 0 850)) :move-arm :rarm :use-torso nil))
(send *pr2* :angle-vector av)
Could not convert RST to MD: No such file or directory - pandoc
Wiki Tutorials
Source Tutorials
Package Dependencies
| Deps | Name | |
|---|---|---|
| 1 | pr2eus | |
| 1 | moveit_msgs | |
| 1 | control_msgs | |
| 1 | roseus | |
| 1 | catkin | |
| 2 | rostest | |
| 1 | pr2_gazebo | |
| 1 | pr2_moveit_config | |
| 1 | pr2_moveit_plugins | |
| 2 | moveit_planners_ompl |
System Dependencies
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged pr2eus_moveit at answers.ros.org
|
pr2eus_moveit package from jsk_pr2eus repojsk_pr2eus pr2eus pr2eus_armnavigation pr2eus_impedance pr2eus_moveit pr2eus_openrave pr2eus_tutorials |
Package Summary
| Tags | No category tags. |
| Version | 0.3.14 |
| License | BSD |
| Build type | CATKIN |
| Use | RECOMMENDED |
Repository Summary
| Checkout URI | https://github.com/jsk-ros-pkg/jsk_pr2eus.git |
| VCS Type | git |
| VCS Version | master |
| Last Updated | 2019-04-27 |
| Dev Status | DEVELOPED |
| Released | RELEASED |
Package Description
Additional Links
Maintainers
- YoheiKakiuchi
Authors
- YoheiKakiuchi
pr2eus_moveit
This package contains euslisp interface file for using moveit
Setting Up
Check if pr2 robot with moveit is already running, if not, run gazebo and moveit by
$ roslaunch pr2eus_moveit test-pr2eus-moveit.test gui:=true
Run roseus, load required packages and setup robot-interface with moveit feature enabled.
(load "package://pr2eus/pr2-interface.l")
(load "package://pr2eus_moveit/euslisp/pr2eus-moveit.l")
(pr2-init)
(send *ri* :set-moveit-environment (instance pr2-moveit-environment :init))
Send collision-free angle-vector
To send collision-free angle-vector, run following command instead of normal :angle-vector
(send *ri* :angle-vector-motion-plan (send *pr2* :reset-pose) :move-arm :rarm :use-torso t)
Plan motions and execute
If you want to specify target enc-coords instead of angle-vector, use following command
(send *ri* :move-end-coords-plan (make-coords :pos #f(700 0 750)) :move-arm :larm :use-torso t)
Use MoveIt IK service
If you want to use IK service provided by MoveIt, try
(setq av (send *ri* :collision-aware-ik (make-coords :pos #f(700 0 850)) :move-arm :rarm :use-torso nil))
(send *pr2* :angle-vector av)
Could not convert RST to MD: No such file or directory - pandoc
Wiki Tutorials
Source Tutorials
Package Dependencies
| Deps | Name | |
|---|---|---|
| 1 | pr2eus | |
| 1 | moveit_msgs | |
| 1 | control_msgs | |
| 1 | roseus | |
| 1 | catkin | |
| 2 | rostest | |
| 1 | pr2_gazebo | |
| 1 | pr2_moveit_config | |
| 1 | pr2_moveit_plugins | |
| 2 | moveit_planners_ompl |
System Dependencies
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged pr2eus_moveit at answers.ros.org
|
pr2eus_moveit package from jsk_pr2eus repojsk_pr2eus pr2eus pr2eus_armnavigation pr2eus_impedance pr2eus_moveit pr2eus_openrave pr2eus_tutorials |
Package Summary
| Tags | No category tags. |
| Version | 0.3.14 |
| License | BSD |
| Build type | CATKIN |
| Use | RECOMMENDED |
Repository Summary
| Checkout URI | https://github.com/jsk-ros-pkg/jsk_pr2eus.git |
| VCS Type | git |
| VCS Version | master |
| Last Updated | 2019-04-27 |
| Dev Status | DEVELOPED |
| Released | RELEASED |
Package Description
Additional Links
Maintainers
- YoheiKakiuchi
Authors
- YoheiKakiuchi
pr2eus_moveit
This package contains euslisp interface file for using moveit
Setting Up
Check if pr2 robot with moveit is already running, if not, run gazebo and moveit by
$ roslaunch pr2eus_moveit test-pr2eus-moveit.test gui:=true
Run roseus, load required packages and setup robot-interface with moveit feature enabled.
(load "package://pr2eus/pr2-interface.l")
(load "package://pr2eus_moveit/euslisp/pr2eus-moveit.l")
(pr2-init)
(send *ri* :set-moveit-environment (instance pr2-moveit-environment :init))
Send collision-free angle-vector
To send collision-free angle-vector, run following command instead of normal :angle-vector
(send *ri* :angle-vector-motion-plan (send *pr2* :reset-pose) :move-arm :rarm :use-torso t)
Plan motions and execute
If you want to specify target enc-coords instead of angle-vector, use following command
(send *ri* :move-end-coords-plan (make-coords :pos #f(700 0 750)) :move-arm :larm :use-torso t)
Use MoveIt IK service
If you want to use IK service provided by MoveIt, try
(setq av (send *ri* :collision-aware-ik (make-coords :pos #f(700 0 850)) :move-arm :rarm :use-torso nil))
(send *pr2* :angle-vector av)
Could not convert RST to MD: No such file or directory - pandoc
Wiki Tutorials
Source Tutorials
Package Dependencies
| Deps | Name | |
|---|---|---|
| 1 | pr2eus | |
| 1 | moveit_msgs | |
| 1 | control_msgs | |
| 1 | roseus | |
| 1 | catkin | |
| 2 | rostest | |
| 1 | pr2_gazebo | |
| 1 | pr2_moveit_config | |
| 1 | pr2_moveit_plugins | |
| 2 | moveit_planners_ompl |
System Dependencies
Dependant Packages
| Name | Repo | Deps |
|---|---|---|
| jsk_interactive_marker | github-jsk-ros-pkg-jsk_visualization |
Launch files
Messages
Services
Plugins
Recent questions tagged pr2eus_moveit at answers.ros.org
|
pr2eus_moveit package from jsk_pr2eus repojsk_pr2eus pr2eus pr2eus_armnavigation pr2eus_impedance pr2eus_moveit pr2eus_openrave pr2eus_tutorials |
Package Summary
| Tags | No category tags. |
| Version | 0.3.14 |
| License | BSD |
| Build type | CATKIN |
| Use | RECOMMENDED |
Repository Summary
| Checkout URI | https://github.com/jsk-ros-pkg/jsk_pr2eus.git |
| VCS Type | git |
| VCS Version | master |
| Last Updated | 2019-04-27 |
| Dev Status | DEVELOPED |
| Released | RELEASED |
Package Description
Additional Links
Maintainers
- YoheiKakiuchi
Authors
- YoheiKakiuchi
pr2eus_moveit
This package contains euslisp interface file for using moveit
Setting Up
Check if pr2 robot with moveit is already running, if not, run gazebo and moveit by
$ roslaunch pr2eus_moveit test-pr2eus-moveit.test gui:=true
Run roseus, load required packages and setup robot-interface with moveit feature enabled.
(load "package://pr2eus/pr2-interface.l")
(load "package://pr2eus_moveit/euslisp/pr2eus-moveit.l")
(pr2-init)
(send *ri* :set-moveit-environment (instance pr2-moveit-environment :init))
Send collision-free angle-vector
To send collision-free angle-vector, run following command instead of normal :angle-vector
(send *ri* :angle-vector-motion-plan (send *pr2* :reset-pose) :move-arm :rarm :use-torso t)
Plan motions and execute
If you want to specify target enc-coords instead of angle-vector, use following command
(send *ri* :move-end-coords-plan (make-coords :pos #f(700 0 750)) :move-arm :larm :use-torso t)
Use MoveIt IK service
If you want to use IK service provided by MoveIt, try
(setq av (send *ri* :collision-aware-ik (make-coords :pos #f(700 0 850)) :move-arm :rarm :use-torso nil))
(send *pr2* :angle-vector av)
Could not convert RST to MD: No such file or directory - pandoc
Wiki Tutorials
Source Tutorials
Package Dependencies
| Deps | Name | |
|---|---|---|
| 1 | pr2eus | |
| 1 | moveit_msgs | |
| 1 | control_msgs | |
| 1 | roseus | |
| 1 | catkin | |
| 2 | rostest | |
| 1 | pr2_gazebo | |
| 1 | pr2_moveit_config | |
| 1 | pr2_moveit_plugins | |
| 2 | moveit_planners_ompl |