diff --git a/.codespell_words b/.codespell_words index 33d567ff91..6be59c42cd 100644 --- a/.codespell_words +++ b/.codespell_words @@ -1,19 +1,19 @@ +aas ang ans atleast ba +brin dof dur iff keyserver nto ot +padd parameterizes planed +sinic tork uint whis -sinic -padd -brin -aas diff --git a/.pre-commit-config.yaml b/.pre-commit-config.yaml index 129be497ef..c8968d84dc 100644 --- a/.pre-commit-config.yaml +++ b/.pre-commit-config.yaml @@ -47,7 +47,7 @@ repos: files: \.(c|cc|cxx|cpp|frag|glsl|h|hpp|hxx|ih|ispc|ipp|java|js|m|proto|vert)$ args: ['-fallback-style=none', '-i'] - repo: https://github.com/codespell-project/codespell - rev: v2.2.6 + rev: v2.3.0 hooks: - id: codespell args: ['--write-changes', '--ignore-words=.codespell_words', '--skip="*.eps"'] diff --git a/moveit_core/distance_field/include/moveit/distance_field/find_internal_points.h b/moveit_core/distance_field/include/moveit/distance_field/find_internal_points.h index f03a42d39f..5af220a81e 100644 --- a/moveit_core/distance_field/include/moveit/distance_field/find_internal_points.h +++ b/moveit_core/distance_field/include/moveit/distance_field/find_internal_points.h @@ -48,7 +48,7 @@ namespace distance_field * * @param [in] body The body to discretize * @param [in] resolution The resolution at which to test - * @param [out] points The points internal to the body are appended to thiss + * @param [out] points The points internal to the body are appended to this * vector. */ void findInternalPointsConvex(const bodies::Body& body, double resolution, EigenSTL::vector_Vector3d& points); diff --git a/moveit_core/online_signal_smoothing/include/moveit/online_signal_smoothing/butterworth_filter.h b/moveit_core/online_signal_smoothing/include/moveit/online_signal_smoothing/butterworth_filter.h index 80212d2fd2..8f5e5b362f 100644 --- a/moveit_core/online_signal_smoothing/include/moveit/online_signal_smoothing/butterworth_filter.h +++ b/moveit_core/online_signal_smoothing/include/moveit/online_signal_smoothing/butterworth_filter.h @@ -60,7 +60,7 @@ namespace online_signal_smoothing * It comes from finding the bilinear transform equivalent of the analog transfer function and * further applying the inverse z-transform. * The parameter "low_pass_filter_coeff" equals (2*pi / tan(omega_d * T)) - * where omega_d is the cutoff frequency and T is the samping period in sec. + * where omega_d is the cutoff frequency and T is the sampling period in sec. */ class ButterworthFilter { @@ -69,7 +69,7 @@ class ButterworthFilter * Constructor. * @param low_pass_filter_coeff Larger filter_coeff-> more smoothing of commands, but more lag. * low_pass_filter_coeff = (2*pi / tan(omega_d * T)) - * where omega_d is the cutoff frequency and T is the samping period in sec. + * where omega_d is the cutoff frequency and T is the sampling period in sec. */ ButterworthFilter(double low_pass_filter_coeff); ButterworthFilter() = delete; diff --git a/moveit_planners/pilz_industrial_motion_planner/src/trajectory_blender_transition_window.cpp b/moveit_planners/pilz_industrial_motion_planner/src/trajectory_blender_transition_window.cpp index a2998e6ecb..159640da14 100644 --- a/moveit_planners/pilz_industrial_motion_planner/src/trajectory_blender_transition_window.cpp +++ b/moveit_planners/pilz_industrial_motion_planner/src/trajectory_blender_transition_window.cpp @@ -274,7 +274,7 @@ bool pilz_industrial_motion_planner::TrajectoryBlenderTransitionWindow::searchIn // (last point of the first trajectory, first point of the second trajectory) Eigen::Isometry3d circ_pose = req.first_trajectory->getLastWayPoint().getFrameTransform(req.link_name); - // Searh for intersection points according to distance + // Search for intersection points according to distance if (!linearSearchIntersectionPoint(req.link_name, circ_pose.translation(), req.blend_radius, req.first_trajectory, true, first_interse_index)) { diff --git a/moveit_ros/planning/planning_scene_monitor/src/planning_scene_monitor.cpp b/moveit_ros/planning/planning_scene_monitor/src/planning_scene_monitor.cpp index 103a7e1d09..106a6fd663 100644 --- a/moveit_ros/planning/planning_scene_monitor/src/planning_scene_monitor.cpp +++ b/moveit_ros/planning/planning_scene_monitor/src/planning_scene_monitor.cpp @@ -866,7 +866,7 @@ void PlanningSceneMonitor::excludeRobotLinksFromOctree() bool warned = false; for (const moveit::core::LinkModel* link : links) { - std::vector shapes = link->getShapes(); // copy shared ptrs on purpuse + std::vector shapes = link->getShapes(); // copy shared ptrs on purpose for (std::size_t j = 0; j < shapes.size(); ++j) { // merge mesh vertices up to 0.1 mm apart diff --git a/moveit_ros/planning_interface/move_group_interface/include/moveit/move_group_interface/move_group_interface.h b/moveit_ros/planning_interface/move_group_interface/include/moveit/move_group_interface/move_group_interface.h index f3c7b6f506..c8b673a1b3 100644 --- a/moveit_ros/planning_interface/move_group_interface/include/moveit/move_group_interface/move_group_interface.h +++ b/moveit_ros/planning_interface/move_group_interface/include/moveit/move_group_interface/move_group_interface.h @@ -103,7 +103,7 @@ class MOVEIT_MOVE_GROUP_INTERFACE_EXPORT MoveGroupInterface MOVEIT_STRUCT_FORWARD(Plan); - /// The representation of a motion plan (as ROS messasges) + /// The representation of a motion plan (as ROS messages) struct Plan { /// The full starting state used for planning diff --git a/moveit_setup_assistant/moveit_setup_controllers/src/controllers_widget.cpp b/moveit_setup_assistant/moveit_setup_controllers/src/controllers_widget.cpp index e902fc78e7..9580de2b3c 100644 --- a/moveit_setup_assistant/moveit_setup_controllers/src/controllers_widget.cpp +++ b/moveit_setup_assistant/moveit_setup_controllers/src/controllers_widget.cpp @@ -355,7 +355,7 @@ void ControllersWidget::deleteController() // Delete actual controller if (setup_step_->deleteController(controller_name)) { - RCLCPP_INFO_STREAM(setup_step_->getLogger(), "Controller " << controller_name << " deleted succefully"); + RCLCPP_INFO_STREAM(setup_step_->getLogger(), "Controller " << controller_name << " deleted successfully"); } else { diff --git a/moveit_setup_assistant/moveit_setup_srdf_plugins/src/robot_poses.cpp b/moveit_setup_assistant/moveit_setup_srdf_plugins/src/robot_poses.cpp index 2d907c92b5..9e9529fbbd 100644 --- a/moveit_setup_assistant/moveit_setup_srdf_plugins/src/robot_poses.cpp +++ b/moveit_setup_assistant/moveit_setup_srdf_plugins/src/robot_poses.cpp @@ -51,7 +51,7 @@ void RobotPoses::onInit() // Set the planning scene // srdf_config_->getPlanningScene()->setName("MoveIt Planning Scene"); - // Collision Detection initializtion ------------------------------- + // Collision Detection initialization ------------------------------- // Setup the request request_.contacts = true;