Skip to content

Commit

Permalink
Viz tutorial (#1)
Browse files Browse the repository at this point in the history
* adding rosdep install and catkin config to instructions
* updating visualization tutorial
  • Loading branch information
mlautman authored and davetcoleman committed May 15, 2018
1 parent 465a0d1 commit fc6d145
Show file tree
Hide file tree
Showing 12 changed files with 16 additions and 15 deletions.
Binary file added doc/ros_visualization/panda_moveit_pr491.png
Loading
Sorry, something went wrong. Reload?
Sorry, we cannot display this file.
Sorry, this file is invalid so it cannot be displayed.
Binary file removed doc/ros_visualization/pr2_moveit_pr491.png
Binary file not shown.
Binary file modified doc/ros_visualization/rviz_interact_button.png
Loading
Sorry, something went wrong. Reload?
Sorry, we cannot display this file.
Sorry, this file is invalid so it cannot be displayed.
Binary file modified doc/ros_visualization/rviz_plugin_collision.png
Loading
Sorry, something went wrong. Reload?
Sorry, we cannot display this file.
Sorry, this file is invalid so it cannot be displayed.
Loading
Sorry, something went wrong. Reload?
Sorry, we cannot display this file.
Sorry, this file is invalid so it cannot be displayed.
Binary file modified doc/ros_visualization/rviz_plugin_interact.png
Loading
Sorry, something went wrong. Reload?
Sorry, we cannot display this file.
Sorry, this file is invalid so it cannot be displayed.
Binary file modified doc/ros_visualization/rviz_plugin_invalid.png
Loading
Sorry, something went wrong. Reload?
Sorry, we cannot display this file.
Sorry, this file is invalid so it cannot be displayed.
Binary file modified doc/ros_visualization/rviz_plugin_motion_planning_add.png
Loading
Sorry, something went wrong. Reload?
Sorry, we cannot display this file.
Sorry, this file is invalid so it cannot be displayed.
Binary file modified doc/ros_visualization/rviz_plugin_planned_path.png
Loading
Sorry, something went wrong. Reload?
Sorry, we cannot display this file.
Sorry, this file is invalid so it cannot be displayed.
Binary file modified doc/ros_visualization/rviz_plugin_start.png
Loading
Sorry, something went wrong. Reload?
Sorry, we cannot display this file.
Sorry, this file is invalid so it cannot be displayed.
Binary file modified doc/ros_visualization/rviz_plugin_visualize_robots.png
Loading
Sorry, something went wrong. Reload?
Sorry, we cannot display this file.
Sorry, this file is invalid so it cannot be displayed.
31 changes: 16 additions & 15 deletions doc/ros_visualization/visualization_tutorial.rst
Original file line number Diff line number Diff line change
Expand Up @@ -9,16 +9,16 @@ robot. We will explore the plugin in this tutorial.
Pre-requisites
---------------

To use the Rviz plugin, a ``moveit_ROBOT_config`` package must exist containing all the necessary
To use the Rviz plugin, a ``ROBOT_moveit_config`` package must exist containing all the necessary
configurations to use MoveIt!. If you are using a standard robot, it is highly likely a MoveIt!
config package already exists, e.g. the PR2, Baxter, UR5, etc. The recommended robot to run these
tutorials is currently the PR2. If you want to try these tutorials with your own
tutorials is currently the Panda. If you want to try these tutorials with your own
custom robot see the `MoveIt! Setup Assistant tutorial
<../setup_assistant/setup_assistant_tutorial.html>`_, otherwise follow these next steps:

**Use Default PR2 MoveIt! Configuration**
**Use Default Panda MoveIt! Configuration**

Note: This tutorial does **not** require you to actually have a PR2 robot, it just needs a set of
Note: This tutorial does **not** require you to actually have a Panda robot, it just needs a set of
working robot model files.

If you don't yet have a catkin workspace for this tutorial, create one now::
Expand All @@ -28,8 +28,10 @@ If you don't yet have a catkin workspace for this tutorial, create one now::

Build and source the moveit_config package::

git clone https://github.com/davetcoleman/pr2_moveit_config.git
git clone https://github.com/PickNikRobotics/panda_moveit_config.git
rosdep install --from-paths . --ignore-src --rosdistro kinetic
cd ..
catkin config --extend /opt/ros/kinetic --cmake-args -DCMAKE_BUILD_TYPE=Release
catkin build
. ~/ws_moveit/devel/setup.bash

Expand All @@ -40,7 +42,7 @@ Step 1: Launch the demo and Configure the Plugin

* Launch the demo::

roslaunch pr2_moveit_config demo.launch
roslaunch panda_moveit_config demo.launch

* If you are doing this for the first time, you will have to add the Motion Planning Plugin.

Expand All @@ -53,14 +55,14 @@ Step 1: Launch the demo and Configure the Plugin

* In the "Global Options" tab of the "Displays" subwindow, set the **Fixed Frame** field to "/odom_combined"

* Now, you can start configuring the Plugin for your robot (the PR2 in
* Now, you can start configuring the Plugin for your robot (the Panda in
this case). Click on "MotionPlanning" within "Displays".

* Make sure the **Robot Description** field is set to "robot_description"

* Make sure the **Planning Scene Topic** field is set to "planning_scene".

* In **Planning Request**, change the **Planning Group** to "right_arm".
* In **Planning Request**, change the **Planning Group** to "arm".

* Set the **Trajectory Topic** in the Planned Path tab to "/move_group/display_planned_path".

Expand Down Expand Up @@ -94,13 +96,13 @@ The display states for each of these visualizations can be toggled on and off us

* Play with all these checkboxes to switch on and off different visualizations.

Step 3: Interact with the PR2
Step 3: Interact with the Panda
-----------------------------

* Press **Interact** in the top menu of rviz (Note: some tools may be
hidden, press **+** in the top menu to add the **Interact** tool as shown below).
You should see a couple of interactive markers appear for the
right arm of the PR2.
arm of the Panda.

* One marker (corresponding to the orange colored right arm) will
be used to set the "Goal State" for motion planning. Another
Expand Down Expand Up @@ -142,16 +144,15 @@ Moving out of reachable workspace
+++++++++++++++++++++++++++++++++

Note also what happens when you try to move an end-effector out of its
reachable workspace (sometimes the access denied sign will not
appear).
reachable workspace.

.. image:: rviz_plugin_invalid.png
:width: 300px

Step 4: Use Motion Planning with the PR2
Step 4: Use Motion Planning with the Panda
----------------------------------------

* Now, you can start motion planning with the PR2 in the MoveIt! Rviz Plugin.
* Now, you can start motion planning with the Panda in the MoveIt! Rviz Plugin.

* Move the Start State to a desired location.

Expand Down Expand Up @@ -183,5 +184,5 @@ You can visually introspect trajectory point by point on RViz.

NOTE: Once you placed your EEF to a new goal, be sure to run `Plan` before running `Play` -- otherwise you'll see the waypoints for the previous goal if available.

.. image:: pr2_moveit_pr491.png
.. image:: panda_moveit_pr491.png
:width: 700px

0 comments on commit fc6d145

Please sign in to comment.