Skip to content

Commit d366a8c

Browse files
authored
Add codespell to .precommit and fix spelling errors (#689)
1 parent 93aa70d commit d366a8c

File tree

13 files changed

+28
-22
lines changed

13 files changed

+28
-22
lines changed

.pre-commit-config.yaml

Lines changed: 6 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -53,3 +53,9 @@ repos:
5353
language: system
5454
always_run: true
5555
pass_filenames: false
56+
- repo: https://github.com/codespell-project/codespell
57+
rev: v2.0.0
58+
hooks:
59+
- id: codespell
60+
args: ['--write-changes', '-L', 'debians']
61+
exclude: _themes

doc/bullet_collision_checker/src/bullet_collision_checker_tutorial.cpp

Lines changed: 2 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -124,7 +124,7 @@ void computeCollisionContactPoints(InteractiveRobot& robot)
124124
color.a = 0.5;
125125
visualization_msgs::MarkerArray markers;
126126

127-
/* Get the contact ponts and display them as markers */
127+
/* Get the contact points and display them as markers */
128128
collision_detection::getCollisionMarkersFromContacts(markers, "panda_link0", c_res.contacts, color,
129129
ros::Duration(), // remain until deleted
130130
0.01); // radius
@@ -310,7 +310,7 @@ int main(int argc, char** argv)
310310
color.g = 0.0;
311311
color.b = 1.0;
312312
color.a = 0.5;
313-
/* Get the contact ponts and display them as markers */
313+
/* Get the contact points and display them as markers */
314314
collision_detection::getCollisionMarkersFromContacts(markers, "panda_link0", res.contacts, color, ros::Duration(),
315315
0.01);
316316
publishMarkers(markers);

doc/chomp_planner/chomp_planner_tutorial.rst

Lines changed: 4 additions & 4 deletions
Original file line numberDiff line numberDiff line change
@@ -34,7 +34,7 @@ If you have the ``panda_moveit_config`` from the `ros-planning/panda_moveit_conf
3434

3535
Running CHOMP with Obstacles in the Scene
3636
+++++++++++++++++++++++++++++++++++++++++
37-
To run CHOMP in an evironment with obstacles, you can run the sample python script:
37+
To run CHOMP in an environment with obstacles, you can run the sample python script:
3838

3939
:codedir:`collision_scene_example.py<collision_environments/scripts/collision_scene_example.py>`.
4040

@@ -52,7 +52,7 @@ or: ::
5252

5353
rosrun moveit_tutorials collision_scene_example.py sparse
5454

55-
Next, in RViz, select CHOMP in the MotionPlanning pannel under the Context tab. Set the desired start and goal states by moving the end-effector around with the imarker and then click on the Plan button under the Planning tab in the MotionPlanning pannel to start planning. The planner will now attempt to find a feasible solution between the given start and end position.
55+
Next, in RViz, select CHOMP in the MotionPlanning panel under the Context tab. Set the desired start and goal states by moving the end-effector around with the imarker and then click on the Plan button under the Planning tab in the MotionPlanning panel to start planning. The planner will now attempt to find a feasible solution between the given start and end position.
5656

5757
Tweaking some of the parameters for CHOMP
5858
-----------------------------------------
@@ -101,7 +101,7 @@ CHOMP has some optimization parameters associated with it. These can be modified
101101
Set this to true/false if you want to use stochastic descent while optimizing the cost. In stochastic descent, a random point from the trajectory is used, rather than all the trajectory points. This is faster and guaranteed to converge, but it may take more iterations in the worst case.
102102

103103
- **enable failure recovery**: ::
104-
If this is set to true, CHOMP tweaks ceratin parameters in the hope to find a solution when one does not exist with the default paramters specified in the ``chomp_planning.yaml`` file.
104+
If this is set to true, CHOMP tweaks certain parameters in the hope to find a solution when one does not exist with the default parameters specified in the ``chomp_planning.yaml`` file.
105105

106106
- **max_recovery_attempts**: ::
107107
This is the maximum times that CHOMP is run with a varied set of parameters after the first attempt with the default parameters.
@@ -159,7 +159,7 @@ To achieve this, follow the steps:
159159
</launch>
160160

161161
#. This launch file defines the new planning pipeline ``ompl-chomp``, deriving from the ``ompl`` pipeline,
162-
but adding the CHOMP post-processor as a planning adapter. Also, the ``trajectory_initialization_method`` is overriden to use the OMPL-generated trajectory.
162+
but adding the CHOMP post-processor as a planning adapter. Also, the ``trajectory_initialization_method`` is overridden to use the OMPL-generated trajectory.
163163

164164
#. Now you can launch the newly configure planning pipeline as follows: ::
165165

doc/controller_configuration/controller_configuration_tutorial.rst

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -170,6 +170,6 @@ All controller names get prefixed by the namespace of their ros_control node. Fo
170170
Controllers for Multiple Nodes
171171
------------------------------
172172

173-
MoveItMultiControllerManager can be used for more than one ros_control nodes. It works by creating several MoveItControllerManagers, one for each node. It instantiates them with their respecitve namespace and takes care of proper delegation. To use it must be added to the launch file. ::
173+
MoveItMultiControllerManager can be used for more than one ros_control nodes. It works by creating several MoveItControllerManagers, one for each node. It instantiates them with their respective namespace and takes care of proper delegation. To use it must be added to the launch file. ::
174174

175175
<param name="moveit_controller_manager" value="moveit_ros_control_interface::MoveItMultiControllerManager" />

doc/move_group_interface/src/move_group_interface_tutorial.cpp

Lines changed: 3 additions & 3 deletions
Original file line numberDiff line numberDiff line change
@@ -66,7 +66,7 @@ int main(int argc, char** argv)
6666
//
6767
// MoveIt operates on sets of joints called "planning groups" and stores them in an object called
6868
// the `JointModelGroup`. Throughout MoveIt the terms "planning group" and "joint model group"
69-
// are used interchangably.
69+
// are used interchangeably.
7070
static const std::string PLANNING_GROUP = "panda_arm";
7171

7272
// The :planning_interface:`MoveGroupInterface` class can be easily
@@ -304,7 +304,7 @@ int main(int argc, char** argv)
304304
const double jump_threshold = 0.0;
305305
const double eef_step = 0.01;
306306
double fraction = move_group_interface.computeCartesianPath(waypoints, eef_step, jump_threshold, trajectory);
307-
ROS_INFO_NAMED("tutorial", "Visualizing plan 4 (Cartesian path) (%.2f%% acheived)", fraction * 100.0);
307+
ROS_INFO_NAMED("tutorial", "Visualizing plan 4 (Cartesian path) (%.2f%% achieved)", fraction * 100.0);
308308

309309
// Visualize the plan in RViz
310310
visual_tools.deleteAllMarkers();
@@ -479,7 +479,7 @@ int main(int argc, char** argv)
479479
visual_tools.trigger();
480480

481481
/* Wait for MoveGroup to receive and process the attached collision object message */
482-
visual_tools.prompt("Press 'next' in the RvizVisualToolsGui window to once the collision object disapears");
482+
visual_tools.prompt("Press 'next' in the RvizVisualToolsGui window to once the collision object disappears");
483483

484484
// END_TUTORIAL
485485

doc/moveit_cpp/src/moveit_cpp_tutorial.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -42,7 +42,7 @@ int main(int argc, char** argv)
4242
// Visualization
4343
// ^^^^^^^^^^^^^
4444
//
45-
// The package MoveItVisualTools provides many capabilties for visualizing objects, robots,
45+
// The package MoveItVisualTools provides many capabilities for visualizing objects, robots,
4646
// and trajectories in RViz as well as debugging tools such as step-by-step introspection of a script
4747
moveit_visual_tools::MoveItVisualTools visual_tools("panda_link0", rvt::RVIZ_MARKER_TOPIC,
4848
moveit_cpp_ptr->getPlanningSceneMonitor());

doc/moveit_grasps/moveit_grasps_tutorial.rst

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

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

217-
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 alligned and you would want to pick obejects from a shelf with a grasp that is horozontally alligned.
217+
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.
218218

219219
Tested Robots
220220
-------------

doc/ompl_interface/ompl_interface_tutorial.rst

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -13,7 +13,7 @@ Longest Valid Segment Fraction
1313

1414
The ``longest_valid_segment_fraction`` defines the discretization of robot motions used for collision checking and greatly affects the performance and reliability of OMPL-based solutions. A ``motion`` in this context can be thought of as an edge between two nodes in a graph, where nodes are waypoints along a trajectory. The default motion collision checker in OMPL simply discretizes the edge into a number of sub-states to collision check. No continuous collision checking is currently available in OMPL/MoveIt, though this is an area of current `discussion <https://github.com/ros-planning/moveit/issues/29>`_.
1515

16-
Specifically, ``longest_valid_segment_fraction`` is the fraction of the robot's state space that, given the robot isn't currently in collision, we assume the robot can travel while remaining collision free. For example, if ``longest_valid_segment_fraction = 0.01``, then we assume that if an edge between two nodes is less than 1/100th of the state space, then we don't need to explicity check any sub-states along that edge, just the two nodes it connects.
16+
Specifically, ``longest_valid_segment_fraction`` is the fraction of the robot's state space that, given the robot isn't currently in collision, we assume the robot can travel while remaining collision free. For example, if ``longest_valid_segment_fraction = 0.01``, then we assume that if an edge between two nodes is less than 1/100th of the state space, then we don't need to explicitly check any sub-states along that edge, just the two nodes it connects.
1717

1818
In addition to the ``longest_valid_segment_fraction`` parameter in the ``ompl_planning.yaml`` file, there is also the ``maximum_waypoint_distance``, found in the :moveit_codedir:`dynamic reconfigure file <moveit_planners/ompl/ompl_interface/cfg/OMPLDynamicReconfigure.cfg#L9>`. ``maximum_waypoint_distance`` defines the same discretization of robot motions for collision checking, but it does so at an absolute level instead of using fractions of the state space. For example, if ``maximum_waypoint_distance = 0.1``, then if an edge is shorter than ``0.1`` in state space distance, then we don't explicitly check any sub-states along that edge.
1919

doc/planning_adapters/planning_adapters_tutorial.rst

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -185,7 +185,7 @@ This will launch RViz, select CHOMP in the Motion Planning panel under the Conte
185185
Planning Insights for different motion planners and planners with planning adapters
186186
-----------------------------------------------------------------------------------
187187

188-
This section has insights as to when to use which planner and how using certain planning request adapters in a certain pipeline can lead to producing robust paths overall. Here we consider using OMPL, STOMP, CHOMP seperately and together to produce robust smooth optimized paths obtained from the planner. For each planner, a basic insight is provided which gives the user an intuition to use a particular planner in a specific situation.
188+
This section has insights as to when to use which planner and how using certain planning request adapters in a certain pipeline can lead to producing robust paths overall. Here we consider using OMPL, STOMP, CHOMP separately and together to produce robust smooth optimized paths obtained from the planner. For each planner, a basic insight is provided which gives the user an intuition to use a particular planner in a specific situation.
189189

190190
- **CHOMP**: CHOMP is an optimization algorithm which optimizes a given initial trajectory. Based on the environment CHOMP rapidly tries to pull the initial trajectory out of collisions. However an important point to pay attention here is that the parameter ``ridge_factor`` needs to be more than or equal to 0.001 for avoiding obstacles. Doing this CHOMP is able to find paths while avoiding obstacles. It should be noted here even though CHOMP can avoid obstacles successfully but it fails to provide smooth paths often leading to jerky paths in the presence of obstacles. For CHOMP collision avoidance comes at the cost of the trajectory's velocity smoothness.
191191

doc/robot_model_and_robot_state/src/robot_model_and_robot_state_tutorial.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -86,7 +86,7 @@ int main(int argc, char** argv)
8686

8787
// Get Joint Values
8888
// ^^^^^^^^^^^^^^^^
89-
// We can retreive the current set of joint values stored in the state for the Panda arm.
89+
// We can retrieve the current set of joint values stored in the state for the Panda arm.
9090
std::vector<double> joint_values;
9191
kinematic_state->copyJointGroupPositions(joint_model_group, joint_values);
9292
for (std::size_t i = 0; i < joint_names.size(); ++i)

0 commit comments

Comments
 (0)