Skip to content

Commit 01cd9d0

Browse files
Check for and fix misspelled MoveIt (#845)
* Fix misspelled MoveIt * Check for MoveIt 2 space * Remove extra space Co-authored-by: Sebastian Castro <[email protected]> --------- Co-authored-by: Sebastian Castro <[email protected]>
1 parent 86237ae commit 01cd9d0

File tree

11 files changed

+17
-11
lines changed

11 files changed

+17
-11
lines changed

.pre-commit-config.yaml

Lines changed: 6 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -34,6 +34,12 @@ repos:
3434

3535
- repo: local
3636
hooks:
37+
- id: misspelled-moveit
38+
name: misspelled-moveit
39+
description: MoveIt should be spelled exactly as MoveIt
40+
language: pygrep
41+
entry: Moveit\W|MoveIt!|Moveit2|MoveIt2
42+
exclude: .pre-commit-config.yaml
3743
- id: clang-format
3844
name: clang-format
3945
description: Format files with ClangFormat.

doc/examples/controller_configuration/controller_configuration_tutorial.rst

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -6,7 +6,7 @@ MoveIt typically publishes manipulator motion commands to a `JointTrajectoryCont
66

77
#. A launch file. This launch file must load the :code:`moveit_controllers` yaml file and specify the :code:`moveit_simple_controller_manager/MoveItSimpleControllerManager`. After these yaml files are loaded, they are passed as parameters to the Move Group node. `Example Move Group launch file <https://github.com/ros-planning/moveit_resources/blob/ros2/panda_moveit_config/launch/demo.launch.py>`_.
88

9-
#. Launch the corresponding :code:`ros2_control` JointTrajectoryControllers. This is separate from the MoveIt2 ecosystem. `Example ros2_control launching <https://github.com/ros-controls/ros2_control_demos>`_. Each JointTrajectoryController provides an action interface. Given the yaml file above, MoveIt automatically connects to this action interface.
9+
#. Launch the corresponding :code:`ros2_control` JointTrajectoryControllers. This is separate from the MoveIt 2 ecosystem. `Example ros2_control launching <https://github.com/ros-controls/ros2_control_demos>`_. Each JointTrajectoryController provides an action interface. Given the yaml file above, MoveIt automatically connects to this action interface.
1010

1111
#. Note: it is not required to use :code:`ros2_control` for your robot. You could write a proprietary action interface. In practice, 99% of users choose :code:`ros2_control`.
1212

doc/examples/creating_moveit_plugins/lerp_motion_planner/src/lerp_example.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -40,7 +40,7 @@
4040

4141
#include <pluginlib/class_loader.h>
4242

43-
// MoveIt!
43+
// MoveIt
4444
#include <moveit/robot_model_loader/robot_model_loader.h>
4545
#include <moveit/planning_interface/planning_interface.h>
4646
#include <moveit/planning_scene/planning_scene.h>

doc/examples/hybrid_planning/hybrid_planning_tutorial.rst

Lines changed: 2 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -1,7 +1,7 @@
11
Hybrid Planning
22
===============
33

4-
In this section, you will learn how to use Moveit 2's *Hybrid Planning* feature.
4+
In this section, you will learn how to use MoveIt 2's *Hybrid Planning* feature.
55

66
Hybrid Planning enables you to (re)plan and execute robot motions online with MoveIt 2 and to add more planning logic into your robot's motion planning pipeline.
77

@@ -90,7 +90,7 @@ To include the Hybrid Planning Architecture into you project you need to add a *
9090
9191
Customizing the Hybrid Planning Architecture
9292
--------------------------------------------
93-
As the rest of Moveit 2, the *Hybrid Planning Architecture* is designed to be highly customizable while also offering the possibility to easily re-use existing solutions. Each of the architecture's components is a ROS 2 node and can be completely replaced by your own custom ROS 2 node as long as it offers the API required by the other nodes. Each component's runtime behavior is defined by plugins. This section focuses on the customization of the *Hybrid Planning Architecture* by implementing your own plugins.
93+
As the rest of MoveIt 2, the *Hybrid Planning Architecture* is designed to be highly customizable while also offering the possibility to easily re-use existing solutions. Each of the architecture's components is a ROS 2 node and can be completely replaced by your own custom ROS 2 node as long as it offers the API required by the other nodes. Each component's runtime behavior is defined by plugins. This section focuses on the customization of the *Hybrid Planning Architecture* by implementing your own plugins.
9494

9595
Global and Local Motion Planning
9696
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

doc/examples/jupyter_notebook_prototyping/jupyter_notebook_prototyping_tutorial.rst

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -16,7 +16,7 @@ The code for this tutorial can be found `here <https://github.com/peterdavidfaga
1616

1717
Getting Started
1818
---------------
19-
To complete this tutorial, you must have set up a colcon workspace that includes MoveIt2 and its corresponding tutorials. An excellent outline on how to set up such a workspace is provided in the :doc:`Getting Started Guide </doc/tutorials/getting_started/getting_started>`.
19+
To complete this tutorial, you must have set up a colcon workspace that includes MoveIt 2 and its corresponding tutorials. An excellent outline on how to set up such a workspace is provided in the :doc:`Getting Started Guide </doc/tutorials/getting_started/getting_started>`.
2020

2121
Once you have set up your workspace, you can execute the code for this tutorial by running the following command (the servo section of this tutorial requires a PS4 Dualshock, if you don't have one consider setting this parameter to false): ::
2222

doc/examples/jupyter_notebook_prototyping/src/moveit_notebook_tutorial.ipynb

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -7,7 +7,7 @@
77
"source": [
88
"# Introduction\n",
99
"\n",
10-
"Welcome to this tutorial on using jupyter notebooks with Moveit 2. A great benefit of being able to interact with MoveIt via a Python notebook is the ability to rapidly prototype code. We hope you find this interface intuitive and that you gain value from using MoveIt via Python notebooks.\n",
10+
"Welcome to this tutorial on using jupyter notebooks with MoveIt 2. A great benefit of being able to interact with MoveIt via a Python notebook is the ability to rapidly prototype code. We hope you find this interface intuitive and that you gain value from using MoveIt via Python notebooks.\n",
1111
"\n",
1212
"In this tutorial we will cover the following: \n",
1313
"\n",

doc/examples/realtime_servo/realtime_servo_tutorial.rst

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -27,7 +27,7 @@ If you haven't already done so, make sure you've completed the steps in :doc:`Ge
2727
Design overview
2828
---------------
2929

30-
Moveit Servo consists of two main parts: The core implementation ``Servo`` which provides a C++ interface, and the ``ServoNode`` which
30+
MoveIt Servo consists of two main parts: The core implementation ``Servo`` which provides a C++ interface, and the ``ServoNode`` which
3131
wraps the C++ interface and provides a ROS interface.The configuration of Servo is done through ROS parameters specified in :moveit_codedir:`servo_parameters.yaml <moveit_ros/moveit_servo/config/servo_parameters.yaml>`
3232

3333
In addition to the servoing capability, MoveIt Servo has some convenient features such as:

doc/examples/time_parameterization/time_parameterization_tutorial.rst

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -20,7 +20,7 @@ MoveIt can support different algorithms for post-processing a kinematic trajecto
2020

2121
* :moveit_codedir:`Time-optimal Trajectory Generation<moveit_core/trajectory_processing/src/time_optimal_trajectory_generation.cpp>`
2222

23-
Time-optimal Trajectory Generation (TOTG) was introduced in PRs `#809 <https://github.com/ros-planning/moveit/pull/809>`_ and `#1365 <https://github.com/ros-planning/moveit/pull/1365>`_. It produces trajectories with very smooth and continuous velocity profiles. The method is based on fitting path segments to the original trajectory and then sampling new waypoints from the optimized path. This is different from strict time parameterization methods as resulting waypoints may divert from the original trajectory within a certain tolerance. As a consequence, additional collision checks might be required when using this method. It is the default everywhere in MoveIt2.
23+
Time-optimal Trajectory Generation (TOTG) was introduced in PRs `#809 <https://github.com/ros-planning/moveit/pull/809>`_ and `#1365 <https://github.com/ros-planning/moveit/pull/1365>`_. It produces trajectories with very smooth and continuous velocity profiles. The method is based on fitting path segments to the original trajectory and then sampling new waypoints from the optimized path. This is different from strict time parameterization methods as resulting waypoints may divert from the original trajectory within a certain tolerance. As a consequence, additional collision checks might be required when using this method. It is the default everywhere in MoveIt 2.
2424

2525
Usage of a time parameterization algorithm as a Planning Request Adapter is documented in `this tutorial <../motion_planning_pipeline/motion_planning_pipeline_tutorial.html#using-a-planning-request-adapter>`_.
2626

doc/how_to_guides/controller_teleoperation/controller_teleoperation.rst

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -21,7 +21,7 @@ Requirements
2121
Steps
2222
-----
2323

24-
1. Build the MoveIt2 workspace
24+
1. Build the MoveIt 2 workspace
2525

2626
First, ``cd`` to the root directory of the moveit2 workspace. (if you followed the :doc:`Getting Started </doc/tutorials/getting_started/getting_started>` tutorial, this will be ``~/ws_moveit/``).
2727

doc/how_to_guides/isaac_panda/.docker/ros_entrypoint.sh

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -1,6 +1,6 @@
11
#!/bin/bash
22

3-
# Source ROS and the MoveIt2 workspace
3+
# Source ROS and the MoveIt 2 workspace
44
source /opt/ros/humble/setup.bash
55
source /root/ws_moveit/install/setup.bash
66
echo "Sourced ROS & MoveIt Humble"

0 commit comments

Comments
 (0)