Skip to content

Commit

Permalink
update links
Browse files Browse the repository at this point in the history
  • Loading branch information
cmower committed Nov 15, 2022
1 parent d41ee5e commit 5b05fa2
Show file tree
Hide file tree
Showing 6 changed files with 16 additions and 16 deletions.
6 changes: 3 additions & 3 deletions doc/additional_features.rst
Original file line number Diff line number Diff line change
Expand Up @@ -141,15 +141,15 @@ ik_ros
:width: 600
:alt: Alternative text

The `ik_ros <https://github.com/cmower/ik_ros>`_ package is a standardized interface for inverse kinematics using ROS.
The `ik_ros <https://github.com/ros-pybullet/ik_ros>`_ package is a standardized interface for inverse kinematics using ROS.
Input data (e.g. end-effector task space goals) are directed to a problem setup node, that collects the information into a single message.
The setup node then publishes a problem message at a given frequency.
A solver node, that interfaces via a standardized plugin to an IK solver, then solves the problem and publishes the target joint state.

safe_robot
----------

A low-level `ROS package <https://github.com/cmower/safe_robot>`_ for the safe operation of robots.
A low-level `ROS package <https://github.com/ros-pybullet/safe_robot>`_ for the safe operation of robots.
Easily setup with a single launch file.
The ``safe_robot_node.py`` acts as a remapper.
Target joint states are passed through several safety checks, if safe then the command is sent to the robot, otherwise they are prevented.
Expand All @@ -163,5 +163,5 @@ Possible checks
custom_ros_tools
----------------

The `custom_ros_tools <https://github.com/cmower/custom_ros_tools>`_ package provides a collection of generic useful tools for ROS.
The `custom_ros_tools <https://github.com/ros-pybullet/custom_ros_tools>`_ package provides a collection of generic useful tools for ROS.
The package is extensively used in the ROS-PyBullet Interface.
2 changes: 1 addition & 1 deletion doc/communication_with_ros.rst
Original file line number Diff line number Diff line change
Expand Up @@ -44,7 +44,7 @@ When this service is called, the response returns the current parameters for the

An object is added to PyBullet.
The service allows you to either load from file or pass the configuration for the object.
The input for the service expects a ``ros_pybullet_interface/PybulletObject`` message - see `here <https://github.com/cmower/ros_pybullet_interface/blob/main/ros_pybullet_interface/msg/PybulletObject.msg>`_.
The input for the service expects a ``ros_pybullet_interface/PybulletObject`` message - see `here <https://github.com/ros-pybullet/ros_pybullet_interface/blob/main/ros_pybullet_interface/msg/PybulletObject.msg>`_.

For both cases (i.e. load from filename or configuration), an ``object_type`` must be given.
Either ``PybulletObject.VISUAL``, ``PybulletObject.COLLISION``, ``PybulletObject.DYNAMIC``, ``PybulletObject.ROBOT``, ``PybulletObject.SOFT``, or ``PybulletObject.URDF``.
Expand Down
4 changes: 2 additions & 2 deletions doc/develop.rst
Original file line number Diff line number Diff line change
Expand Up @@ -7,8 +7,8 @@ Contributing
------------

We are more than happy to accept bug fixes, new features, suggestions, comments, or any other form of feedback.
If you have an issue using the interface, or would like a new feature added please `submit an issue <https://github.com/cmower/ros_pybullet_interface/issues>`_.
For pull requests, please `fork the repository <https://github.com/cmower/ros_pybullet_interface/fork>`_, create a new branch, and submit your pull request.
If you have an issue using the interface, or would like a new feature added please `submit an issue <https://github.com/ros-pybullet/ros_pybullet_interface/issues>`_.
For pull requests, please `fork the repository <https://github.com/ros-pybullet/ros_pybullet_interface/fork>`_, create a new branch, and submit your pull request.

Future work
-----------
Expand Down
14 changes: 7 additions & 7 deletions doc/examples.rst
Original file line number Diff line number Diff line change
Expand Up @@ -3,7 +3,7 @@
Examples
========

The examples for the ROS-PyBullet Interface are collected in a dedicated ROS package `rpbi_examples <https://github.com/cmower/ros_pybullet_interface/tree/main/rpbi_examples>`_.
The examples for the ROS-PyBullet Interface are collected in a dedicated ROS package `rpbi_examples <https://github.com/ros-pybullet/ros_pybullet_interface/tree/main/rpbi_examples>`_.
The following gives details for each example and shows how to run them.

Basic Examples
Expand All @@ -14,15 +14,15 @@ Basic Examples
$ roslaunch basic_example_[NAME].launch
The basic examples simply demonstrate the current robots that can be loaded into PyBullet out-of-the-box.
Each example loads the given robot, and `a node <https://github.com/cmower/ros_pybullet_interface/blob/main/rpbi_examples/scripts/basic_robot_example_node.py>`_ that generates a standardized motion on the robot.
Each example loads the given robot, and `a node <https://github.com/ros-pybullet/ros_pybullet_interface/blob/main/rpbi_examples/scripts/basic_robot_example_node.py>`_ that generates a standardized motion on the robot.
Some of the basic examples demonstrate different features of the library (e.g. recording a video, loading a URDF from the ROS parameter ``robot_description``).
The following list links to the launch file for all the currently available basic examples.

* `Kuka LWR <https://github.com/cmower/ros_pybullet_interface/blob/main/rpbi_examples/launch/basic_example_kuka_lwr.launch>`_
* `Talos <https://github.com/cmower/ros_pybullet_interface/blob/main/rpbi_examples/launch/basic_example_talos.launch>`_
* `Kinova <https://github.com/cmower/ros_pybullet_interface/blob/main/rpbi_examples/launch/basic_example_kinova.launch>`_
* `Human model <https://github.com/cmower/ros_pybullet_interface/blob/main/rpbi_examples/launch/basic_example_human_model.launch>`_
* `Nextage <https://github.com/cmower/ros_pybullet_interface/blob/main/rpbi_examples/launch/basic_example_nextage.launch>`_
* `Kuka LWR <https://github.com/ros-pybullet/ros_pybullet_interface/blob/main/rpbi_examples/launch/basic_example_kuka_lwr.launch>`_
* `Talos <https://github.com/ros-pybullet/ros_pybullet_interface/blob/main/rpbi_examples/launch/basic_example_talos.launch>`_
* `Kinova <https://github.com/ros-pybullet/ros_pybullet_interface/blob/main/rpbi_examples/launch/basic_example_kinova.launch>`_
* `Human model <https://github.com/ros-pybullet/ros_pybullet_interface/blob/main/rpbi_examples/launch/basic_example_human_model.launch>`_
* `Nextage <https://github.com/ros-pybullet/ros_pybullet_interface/blob/main/rpbi_examples/launch/basic_example_nextage.launch>`_

*Note*, the Kuka LWR example additionally demonstrates how to start recording videos and also how to attach a Force-Torque sensor to a robot joint.

Expand Down
2 changes: 1 addition & 1 deletion doc/installation.rst
Original file line number Diff line number Diff line change
Expand Up @@ -34,7 +34,7 @@ From source

1. `Create a catkin workspace <https://catkin-tools.readthedocs.io/en/latest/quick_start.html#initializing-a-new-workspace>`_ or use an existing workspace. `catkin_tools <https://catkin-tools.readthedocs.io/en/latest/>`_ is the preferred build system.
2. ``cd`` to the ``src`` directory of your catkin workspace.
3. Clone this repository: ``$ git clone https://github.com/cmower/ros_pybullet_interface.git``
3. Clone this repository: ``$ git clone https://github.com/ros-pybullet/ros_pybullet_interface.git``
4. Install source dependencies: ``$ rosinstall . --catkin --nobuild``
5. Install binary dependencies: ``$ rosdep update ; rosdep install --from-paths ./ -iry``
6. Compile the workspace: ``$ catkin build -s``
Expand Down
4 changes: 2 additions & 2 deletions doc/main_configuration.rst
Original file line number Diff line number Diff line change
Expand Up @@ -45,8 +45,8 @@ The benefit for this style-guide is that it allows you to easily tell the differ
Furthermore, for the ``camelCase`` functions/parameters, you can look these up in the `PyBullet Quickstart Guide <https://docs.google.com/document/d/10sXEhzFRSnvFcl3XxNGhnD4N2SedqwdAvK3dsihxVUA/edit#heading=h.2ye70wns7io3>`_.
Note, there are some exceptions to the rules however these are documented when necessary.

Our basic "hello world example" is launched using `basic_example_kuka_lwr.launch <https://github.com/cmower/ros_pybullet_interface/blob/main/rpbi_examples/launch/basic_example_kuka_lwr.launch>`_.
The main configuration file, `config.yaml <https://github.com/cmower/ros_pybullet_interface/blob/main/rpbi_examples/configs/basic_example_kuka_lwr/config.yaml>`_, is given as follows.
Our basic "hello world example" is launched using `basic_example_kuka_lwr.launch <https://github.com/ros-pybullet/ros_pybullet_interface/blob/main/rpbi_examples/launch/basic_example_kuka_lwr.launch>`_.
The main configuration file, `config.yaml <https://github.com/ros-pybullet/ros_pybullet_interface/blob/main/rpbi_examples/configs/basic_example_kuka_lwr/config.yaml>`_, is given as follows.

.. code-block:: yaml
Expand Down

0 comments on commit 5b05fa2

Please sign in to comment.