From 5839f6bbc989382c951129e353a2355253c09497 Mon Sep 17 00:00:00 2001 From: Kenji Miyake <31987104+kenji-miyake@users.noreply.github.com> Date: Tue, 22 Feb 2022 18:59:21 +0900 Subject: [PATCH] chore: remove unnecessary comments for uncrustify (#431) Signed-off-by: Kenji Miyake --- ...el_based_approximate_compare_map_filter_nodelet.cpp | 6 ++---- .../occupancy_grid_map_outlier_filter_nodelet.hpp | 5 +---- .../motion_velocity_smoother_node.hpp | 9 +++------ .../analytical_jerk_constrained_smoother.hpp | 9 ++------- .../velocity_planning_utils.hpp | 2 -- .../analytical_jerk_constrained_smoother.cpp | 10 ++-------- .../velocity_planning_utils.cpp | 6 ++---- .../occupancy_grid_map_binary_bayes_filter_updater.hpp | 2 -- 8 files changed, 12 insertions(+), 37 deletions(-) diff --git a/perception/compare_map_segmentation/src/voxel_based_approximate_compare_map_filter_nodelet.cpp b/perception/compare_map_segmentation/src/voxel_based_approximate_compare_map_filter_nodelet.cpp index 77e5d649d3478..78bdf191f3d8a 100644 --- a/perception/compare_map_segmentation/src/voxel_based_approximate_compare_map_filter_nodelet.cpp +++ b/perception/compare_map_segmentation/src/voxel_based_approximate_compare_map_filter_nodelet.cpp @@ -12,16 +12,14 @@ // See the License for the specific language governing permissions and // limitations under the License. -#include - -// *INDENT-OFF* #include "compare_map_segmentation/voxel_based_approximate_compare_map_filter_nodelet.hpp" -// *INDENT-ON* #include #include #include +#include + namespace compare_map_segmentation { using pointcloud_preprocessor::get_param; diff --git a/perception/occupancy_grid_map_outlier_filter/include/occupancy_grid_map_outlier_filter/occupancy_grid_map_outlier_filter_nodelet.hpp b/perception/occupancy_grid_map_outlier_filter/include/occupancy_grid_map_outlier_filter/occupancy_grid_map_outlier_filter_nodelet.hpp index 52e3f22344e8b..4ae0fde705e18 100644 --- a/perception/occupancy_grid_map_outlier_filter/include/occupancy_grid_map_outlier_filter/occupancy_grid_map_outlier_filter_nodelet.hpp +++ b/perception/occupancy_grid_map_outlier_filter/include/occupancy_grid_map_outlier_filter/occupancy_grid_map_outlier_filter_nodelet.hpp @@ -81,16 +81,13 @@ class OccupancyGridMapOutlierFilterComponent : public rclcpp::Node private: class Debugger { - // *INDENT-OFF* public: - // *INDENT-ON* explicit Debugger(OccupancyGridMapOutlierFilterComponent & node); void publishOutlier(const PclPointCloud & input, const Header & header); void publishHighConfidence(const PclPointCloud & input, const Header & header); void publishLowConfidence(const PclPointCloud & input, const Header & header); - // *INDENT-OFF* + private: - // *INDENT-ON* void transformToBaseLink( const PclPointCloud & input, const Header & header, PointCloud2 & output); rclcpp::Publisher::SharedPtr outlier_pointcloud_pub_; diff --git a/planning/motion_velocity_smoother/include/motion_velocity_smoother/motion_velocity_smoother_node.hpp b/planning/motion_velocity_smoother/include/motion_velocity_smoother/motion_velocity_smoother_node.hpp index 8191ce9d4ac59..7c8c3f660bf07 100644 --- a/planning/motion_velocity_smoother/include/motion_velocity_smoother/motion_velocity_smoother_node.hpp +++ b/planning/motion_velocity_smoother/include/motion_velocity_smoother/motion_velocity_smoother_node.hpp @@ -16,9 +16,12 @@ #define MOTION_VELOCITY_SMOOTHER__MOTION_VELOCITY_SMOOTHER_NODE_HPP_ #include "motion_velocity_smoother/resample.hpp" +#include "motion_velocity_smoother/smoother/analytical_jerk_constrained_smoother/analytical_jerk_constrained_smoother.hpp" #include "motion_velocity_smoother/smoother/jerk_filtered_smoother.hpp" #include "motion_velocity_smoother/smoother/l2_pseudo_jerk_smoother.hpp" #include "motion_velocity_smoother/smoother/linf_pseudo_jerk_smoother.hpp" +#include "motion_velocity_smoother/smoother/smoother_base.hpp" +#include "motion_velocity_smoother/trajectory_utils.hpp" #include "osqp_interface/osqp_interface.hpp" #include "rclcpp/rclcpp.hpp" #include "tf2/utils.h" @@ -43,12 +46,6 @@ #include #include -// *INDENT-OFF* -#include "motion_velocity_smoother/smoother/analytical_jerk_constrained_smoother/analytical_jerk_constrained_smoother.hpp" -// *INDENT-ON* -#include "motion_velocity_smoother/smoother/smoother_base.hpp" -#include "motion_velocity_smoother/trajectory_utils.hpp" - namespace motion_velocity_smoother { using autoware_auto_planning_msgs::msg::Trajectory; diff --git a/planning/motion_velocity_smoother/include/motion_velocity_smoother/smoother/analytical_jerk_constrained_smoother/analytical_jerk_constrained_smoother.hpp b/planning/motion_velocity_smoother/include/motion_velocity_smoother/smoother/analytical_jerk_constrained_smoother/analytical_jerk_constrained_smoother.hpp index a8e6c20ca6276..a02d0508ac977 100644 --- a/planning/motion_velocity_smoother/include/motion_velocity_smoother/smoother/analytical_jerk_constrained_smoother/analytical_jerk_constrained_smoother.hpp +++ b/planning/motion_velocity_smoother/include/motion_velocity_smoother/smoother/analytical_jerk_constrained_smoother/analytical_jerk_constrained_smoother.hpp @@ -12,11 +12,11 @@ // See the License for the specific language governing permissions and // limitations under the License. -// *INDENT-OFF* #ifndef MOTION_VELOCITY_SMOOTHER__SMOOTHER__ANALYTICAL_JERK_CONSTRAINED_SMOOTHER__ANALYTICAL_JERK_CONSTRAINED_SMOOTHER_HPP_ // NOLINT #define MOTION_VELOCITY_SMOOTHER__SMOOTHER__ANALYTICAL_JERK_CONSTRAINED_SMOOTHER__ANALYTICAL_JERK_CONSTRAINED_SMOOTHER_HPP_ // NOLINT -// *INDENT-ON* +#include "motion_velocity_smoother/smoother/analytical_jerk_constrained_smoother/velocity_planning_utils.hpp" +#include "motion_velocity_smoother/smoother/smoother_base.hpp" #include "rclcpp/rclcpp.hpp" #include "tf2/utils.h" #include "tier4_autoware_utils/trajectory/trajectory.hpp" @@ -28,11 +28,6 @@ #include #include -// *INDENT-OFF* -#include "motion_velocity_smoother/smoother/analytical_jerk_constrained_smoother/velocity_planning_utils.hpp" -// *INDENT-ON* -#include "motion_velocity_smoother/smoother/smoother_base.hpp" - namespace motion_velocity_smoother { class AnalyticalJerkConstrainedSmoother : public SmootherBase diff --git a/planning/motion_velocity_smoother/include/motion_velocity_smoother/smoother/analytical_jerk_constrained_smoother/velocity_planning_utils.hpp b/planning/motion_velocity_smoother/include/motion_velocity_smoother/smoother/analytical_jerk_constrained_smoother/velocity_planning_utils.hpp index 4875fac23e18d..3f1aea85d94df 100644 --- a/planning/motion_velocity_smoother/include/motion_velocity_smoother/smoother/analytical_jerk_constrained_smoother/velocity_planning_utils.hpp +++ b/planning/motion_velocity_smoother/include/motion_velocity_smoother/smoother/analytical_jerk_constrained_smoother/velocity_planning_utils.hpp @@ -12,10 +12,8 @@ // See the License for the specific language governing permissions and // limitations under the License. -// *INDENT-OFF* #ifndef MOTION_VELOCITY_SMOOTHER__SMOOTHER__ANALYTICAL_JERK_CONSTRAINED_SMOOTHER__VELOCITY_PLANNING_UTILS_HPP_ // NOLINT #define MOTION_VELOCITY_SMOOTHER__SMOOTHER__ANALYTICAL_JERK_CONSTRAINED_SMOOTHER__VELOCITY_PLANNING_UTILS_HPP_ // NOLINT -// *INDENT-ON* #include "motion_velocity_smoother/linear_interpolation.hpp" #include "rclcpp/rclcpp.hpp" diff --git a/planning/motion_velocity_smoother/src/smoother/analytical_jerk_constrained_smoother/analytical_jerk_constrained_smoother.cpp b/planning/motion_velocity_smoother/src/smoother/analytical_jerk_constrained_smoother/analytical_jerk_constrained_smoother.cpp index 31792e1322f45..5c49a88986b39 100644 --- a/planning/motion_velocity_smoother/src/smoother/analytical_jerk_constrained_smoother/analytical_jerk_constrained_smoother.cpp +++ b/planning/motion_velocity_smoother/src/smoother/analytical_jerk_constrained_smoother/analytical_jerk_constrained_smoother.cpp @@ -12,16 +12,14 @@ // See the License for the specific language governing permissions and // limitations under the License. +#include "motion_velocity_smoother/smoother/analytical_jerk_constrained_smoother/analytical_jerk_constrained_smoother.hpp" + #include #include #include #include #include -// *INDENT-OFF* -#include "motion_velocity_smoother/smoother/analytical_jerk_constrained_smoother/analytical_jerk_constrained_smoother.hpp" -// *INDENT-ON* - namespace { using TrajectoryPoints = std::vector; @@ -544,14 +542,12 @@ bool AnalyticalJerkConstrainedSmoother::calcEnoughDistForDecel( const double a0 = trajectory.at(start_index).acceleration_mps2; const double jerk_acc = std::abs(planning_jerk); const double jerk_dec = planning_jerk; - // *INDENT-OFF* auto calcMinAcc = [¶ms](const double planning_jerk) { if (planning_jerk < params.backward.min_jerk_mild_stop) { return params.backward.min_acc; } return params.backward.min_acc_mild_stop; }; - // *INDENT-ON* const double min_acc = calcMinAcc(planning_jerk); type = 0; times.clear(); @@ -589,14 +585,12 @@ bool AnalyticalJerkConstrainedSmoother::applyDecelVelocityFilter( const double a0 = output_trajectory.at(decel_start_index).acceleration_mps2; const double jerk_acc = std::abs(planning_jerk); const double jerk_dec = planning_jerk; - // *INDENT-OFF* auto calcMinAcc = [¶ms](const double planning_jerk) { if (planning_jerk < params.backward.min_jerk_mild_stop) { return params.backward.min_acc; } return params.backward.min_acc_mild_stop; }; - // *INDENT-ON* const double min_acc = calcMinAcc(planning_jerk); if (!analytical_velocity_planning_utils::calcStopVelocityWithConstantJerkAccLimit( diff --git a/planning/motion_velocity_smoother/src/smoother/analytical_jerk_constrained_smoother/velocity_planning_utils.cpp b/planning/motion_velocity_smoother/src/smoother/analytical_jerk_constrained_smoother/velocity_planning_utils.cpp index 8fabcb13be0f3..9a55dbe673f63 100644 --- a/planning/motion_velocity_smoother/src/smoother/analytical_jerk_constrained_smoother/velocity_planning_utils.cpp +++ b/planning/motion_velocity_smoother/src/smoother/analytical_jerk_constrained_smoother/velocity_planning_utils.cpp @@ -12,13 +12,11 @@ // See the License for the specific language governing permissions and // limitations under the License. +#include "motion_velocity_smoother/smoother/analytical_jerk_constrained_smoother/velocity_planning_utils.hpp" + #include #include -// *INDENT-OFF* -#include "motion_velocity_smoother/smoother/analytical_jerk_constrained_smoother/velocity_planning_utils.hpp" -// *INDENT-ON* - namespace motion_velocity_smoother { namespace analytical_velocity_planning_utils diff --git a/sensing/laserscan_to_occupancy_grid_map/include/laserscan_to_occupancy_grid_map/updater/occupancy_grid_map_binary_bayes_filter_updater.hpp b/sensing/laserscan_to_occupancy_grid_map/include/laserscan_to_occupancy_grid_map/updater/occupancy_grid_map_binary_bayes_filter_updater.hpp index 2e351df7b6a78..91610a70ae869 100644 --- a/sensing/laserscan_to_occupancy_grid_map/include/laserscan_to_occupancy_grid_map/updater/occupancy_grid_map_binary_bayes_filter_updater.hpp +++ b/sensing/laserscan_to_occupancy_grid_map/include/laserscan_to_occupancy_grid_map/updater/occupancy_grid_map_binary_bayes_filter_updater.hpp @@ -12,10 +12,8 @@ // See the License for the specific language governing permissions and // limitations under the License. -// *INDENT-OFF* #ifndef LASERSCAN_TO_OCCUPANCY_GRID_MAP__UPDATER__OCCUPANCY_GRID_MAP_BINARY_BAYES_FILTER_UPDATER_HPP_ #define LASERSCAN_TO_OCCUPANCY_GRID_MAP__UPDATER__OCCUPANCY_GRID_MAP_BINARY_BAYES_FILTER_UPDATER_HPP_ -// *INDENT-ON* #include "laserscan_to_occupancy_grid_map/updater/occupancy_grid_map_updater_interface.hpp"