From 5b05fa2f477823d231f956abe08a8c59fd30f8a2 Mon Sep 17 00:00:00 2001 From: "Christopher E. Mower" Date: Tue, 15 Nov 2022 17:00:35 +0000 Subject: [PATCH] update links --- doc/additional_features.rst | 6 +++--- doc/communication_with_ros.rst | 2 +- doc/develop.rst | 4 ++-- doc/examples.rst | 14 +++++++------- doc/installation.rst | 2 +- doc/main_configuration.rst | 4 ++-- 6 files changed, 16 insertions(+), 16 deletions(-) diff --git a/doc/additional_features.rst b/doc/additional_features.rst index cbda0f8b..cfd6b41b 100644 --- a/doc/additional_features.rst +++ b/doc/additional_features.rst @@ -141,7 +141,7 @@ ik_ros :width: 600 :alt: Alternative text -The `ik_ros `_ package is a standardized interface for inverse kinematics using ROS. +The `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. @@ -149,7 +149,7 @@ A solver node, that interfaces via a standardized plugin to an IK solver, then s safe_robot ---------- -A low-level `ROS package `_ for the safe operation of robots. +A low-level `ROS package `_ 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. @@ -163,5 +163,5 @@ Possible checks custom_ros_tools ---------------- -The `custom_ros_tools `_ package provides a collection of generic useful tools for ROS. +The `custom_ros_tools `_ package provides a collection of generic useful tools for ROS. The package is extensively used in the ROS-PyBullet Interface. diff --git a/doc/communication_with_ros.rst b/doc/communication_with_ros.rst index 32d03a1b..92d61d5a 100644 --- a/doc/communication_with_ros.rst +++ b/doc/communication_with_ros.rst @@ -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 `_. +The input for the service expects a ``ros_pybullet_interface/PybulletObject`` message - see `here `_. 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``. diff --git a/doc/develop.rst b/doc/develop.rst index 3febe1bf..5a7445d5 100644 --- a/doc/develop.rst +++ b/doc/develop.rst @@ -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 `_. -For pull requests, please `fork the repository `_, 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 `_. +For pull requests, please `fork the repository `_, create a new branch, and submit your pull request. Future work ----------- diff --git a/doc/examples.rst b/doc/examples.rst index e3ae8e3e..45e6c862 100644 --- a/doc/examples.rst +++ b/doc/examples.rst @@ -3,7 +3,7 @@ Examples ======== -The examples for the ROS-PyBullet Interface are collected in a dedicated ROS package `rpbi_examples `_. +The examples for the ROS-PyBullet Interface are collected in a dedicated ROS package `rpbi_examples `_. The following gives details for each example and shows how to run them. Basic Examples @@ -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 `_ that generates a standardized motion on the robot. +Each example loads the given robot, and `a node `_ 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 `_ -* `Talos `_ -* `Kinova `_ -* `Human model `_ -* `Nextage `_ +* `Kuka LWR `_ +* `Talos `_ +* `Kinova `_ +* `Human model `_ +* `Nextage `_ *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. diff --git a/doc/installation.rst b/doc/installation.rst index 6d4f2f94..32ae1b3b 100644 --- a/doc/installation.rst +++ b/doc/installation.rst @@ -34,7 +34,7 @@ From source 1. `Create a catkin workspace `_ or use an existing workspace. `catkin_tools `_ 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`` diff --git a/doc/main_configuration.rst b/doc/main_configuration.rst index 1bbd4789..19f1298a 100644 --- a/doc/main_configuration.rst +++ b/doc/main_configuration.rst @@ -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 `_. 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 `_. -The main configuration file, `config.yaml `_, is given as follows. +Our basic "hello world example" is launched using `basic_example_kuka_lwr.launch `_. +The main configuration file, `config.yaml `_, is given as follows. .. code-block:: yaml