Skip to content

Commit e5678f8

Browse files
authored
Update codespell-project/codespell (#960)
1 parent faf42b0 commit e5678f8

File tree

9 files changed

+10
-9
lines changed

9 files changed

+10
-9
lines changed

.codespell_words

Lines changed: 1 addition & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -0,0 +1 @@
1+
SINIC

.pre-commit-config.yaml

Lines changed: 2 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -49,7 +49,7 @@ repos:
4949
args: ['-fallback-style=none', '-i']
5050

5151
- repo: https://github.com/codespell-project/codespell
52-
rev: v2.0.0
52+
rev: v2.3.0
5353
hooks:
5454
- id: codespell
55-
args: ['--write-changes']
55+
args: ['--write-changes', '--ignore-words=.codespell_words']

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

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -72,7 +72,7 @@ bool LERPInterface::solve(const planning_scene::PlanningSceneConstPtr& planning_
7272
std::vector<double> start_joint_values;
7373
start_state->copyJointGroupPositions(joint_model_group, start_joint_values);
7474

75-
// This planner only supports one goal constriant in the request
75+
// This planner only supports one goal constraint in the request
7676
std::vector<moveit_msgs::Constraints> goal_constraints = req.goal_constraints;
7777
std::vector<moveit_msgs::JointConstraint> goal_joint_constraint = goal_constraints[0].joint_constraints;
7878

doc/examples/hybrid_planning/hybrid_planning_tutorial.rst

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -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 reuse 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/moveit_grasps/moveit_grasps_tutorial.rst

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -219,7 +219,7 @@ The ``setIdealGraspPoseRPY()`` and ``setIdealGraspPose()`` methods in GraspGener
219219

220220
These methods is used to score grasp candidates favoring grasps that are closer to the desired orientation.
221221

222-
This is useful in applications such as bin and shelf picking where you would want to pick the objects from a bin with a grasp that is vertically aligned and you would want to pick obejects from a shelf with a grasp that is horozontally aligned.
222+
This is useful in applications such as bin and shelf picking where you would want to pick the objects from a bin with a grasp that is vertically aligned and you would want to pick objects from a shelf with a grasp that is horizontally aligned.
223223

224224
Tested Robots
225225
-------------

doc/examples/realtime_servo/realtime_servo_tutorial.rst

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -104,7 +104,7 @@ Because the kinematics are handled by the core parts of MoveIt, it is recommende
104104

105105
Using the C++ API
106106
------------------
107-
This can be beneficial when there is a performance requirement to avoid the overhead of ROS communication infrastucture, or when the output generated by Servo needs to be fed into some other controller that does not have a ROS interface.
107+
This can be beneficial when there is a performance requirement to avoid the overhead of ROS communication infrastructure, or when the output generated by Servo needs to be fed into some other controller that does not have a ROS interface.
108108

109109
When using MoveIt Servo with the C++ interface the three input command types are ``JointJogCommand``, ``TwistCommand`` and ``PoseCommand``.
110110
The output from Servo when using the C++ interface is ``KinematicState``, a struct containing joint names, positions, velocities and accelerations.

doc/examples/trajopt_planner/trajopt_planner_tutorial.rst

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -75,7 +75,7 @@ Motion planning problem in TrajOpt is defined by a set of cost (COST) and constr
7575

7676
- *GIVEN_TRAJ*: the user provides the entire trajectory for ``data`` member.
7777

78-
- **TermInfo**: This is the base struct for all types of COST and CNT functions that are carried by ``cost_infos`` and ``cnt_infos`` members. COST functions are the objectives that are supposed to be minimized and CNT are the ones that must be satisfied. The current implementation contains ``JointPoseTermInfo``, ``JointVelTermInfo`` (hard-coded) and ``CartPoseTermInfo`` (is partially implemented). Member *term_type* dictates the type of the term we are adding; it could be ``TT_COST`` or ``TT_CNT`` which means a cost term or constraint term respectively. Also ``TT_USE_TIME`` can be selected for this member which allows time parameterization. In this case *use_time* of ``BasicInfo`` should be set to ``true`` as well. The other parameters of these terms which need to be set are loaded from ``trajopt_planning.yaml`` file. The following list describes these parametrs:
78+
- **TermInfo**: This is the base struct for all types of COST and CNT functions that are carried by ``cost_infos`` and ``cnt_infos`` members. COST functions are the objectives that are supposed to be minimized and CNT are the ones that must be satisfied. The current implementation contains ``JointPoseTermInfo``, ``JointVelTermInfo`` (hard-coded) and ``CartPoseTermInfo`` (is partially implemented). Member *term_type* dictates the type of the term we are adding; it could be ``TT_COST`` or ``TT_CNT`` which means a cost term or constraint term respectively. Also ``TT_USE_TIME`` can be selected for this member which allows time parameterization. In this case *use_time* of ``BasicInfo`` should be set to ``true`` as well. The other parameters of these terms which need to be set are loaded from ``trajopt_planning.yaml`` file. The following list describes these parameters:
7979

8080
- *coeffs*: weight coefficients for joints
8181

doc/tutorials/pick_and_place_with_moveit_task_constructor/pick_and_place_with_moveit_task_constructor.rst

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -426,7 +426,7 @@ As mentioned above, this function creates a MoveIt Task Constructor object and s
426426
task.setProperty("eef", hand_group_name);
427427
task.setProperty("ik_frame", hand_frame);
428428

429-
Now, we add an example stage to the node. The first line sets ``current_state_ptr`` to ``nullptr``; this creates a pointer to a stage such that we can re-use stage information in specific scenarios. This line is not used at this moment, but will be used later when more stages are added to the task. Next, we make a ``current_state`` stage (a generator stage) and add it to our task - this starts the robot off in its current state. Now that we've created the ``CurrentState`` stage, we save a pointer to it in the ``current_state_ptr`` for later use.
429+
Now, we add an example stage to the node. The first line sets ``current_state_ptr`` to ``nullptr``; this creates a pointer to a stage such that we can reuse stage information in specific scenarios. This line is not used at this moment, but will be used later when more stages are added to the task. Next, we make a ``current_state`` stage (a generator stage) and add it to our task - this starts the robot off in its current state. Now that we've created the ``CurrentState`` stage, we save a pointer to it in the ``current_state_ptr`` for later use.
430430

431431
.. code-block:: c++
432432

doc/tutorials/your_first_project/your_first_project.rst

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -177,7 +177,7 @@ In the workspace directory, ``ws_moveit``, run this command:
177177
178178
colcon build --mixin debug
179179
180-
After this succeeds, we need to re-use the demo launch file from the previous tutorial to start RViz and the MoveGroup node.
180+
After this succeeds, we need to reuse the demo launch file from the previous tutorial to start RViz and the MoveGroup node.
181181
In a separate terminal, source the workspace and then execute this:
182182

183183
.. code-block:: bash

0 commit comments

Comments
 (0)