Skip to content

Commit cbca72a

Browse files
style(pre-commit): autofix
1 parent 0358466 commit cbca72a

File tree

22 files changed

+70
-90
lines changed

22 files changed

+70
-90
lines changed

common/component_interface_utils/include/component_interface_utils/rclcpp.hpp

+1-2
Original file line numberDiff line numberDiff line change
@@ -94,8 +94,7 @@ class NodeAdaptor
9494
C & cli, S & srv, CallbackGroup group, std::optional<double> timeout = std::nullopt) const
9595
{
9696
init_cli(cli);
97-
init_srv(
98-
srv, [cli, timeout](auto req, auto res) { *res = *cli->call(req, timeout); }, group);
97+
init_srv(srv, [cli, timeout](auto req, auto res) { *res = *cli->call(req, timeout); }, group);
9998
}
10099

101100
/// Create a subscription wrapper.

common/motion_utils/test/src/trajectory/test_trajectory.cpp

+1-2
Original file line numberDiff line numberDiff line change
@@ -5379,8 +5379,7 @@ TEST(Trajectory, removeInvalidOrientationPoints)
53795379
auto traj = generateTestTrajectory<Trajectory>(10, 1.0, 1.0);
53805380

53815381
// no invalid points
5382-
testRemoveInvalidOrientationPoints(
5383-
traj, [](Trajectory &) {}, traj.points.size());
5382+
testRemoveInvalidOrientationPoints(traj, [](Trajectory &) {}, traj.points.size());
53845383

53855384
// invalid point at the end
53865385
testRemoveInvalidOrientationPoints(

common/tensorrt_common/src/simple_profiler.cpp

+5-11
Original file line numberDiff line numberDiff line change
@@ -96,15 +96,10 @@ std::ostream & operator<<(std::ostream & out, SimpleProfiler & value)
9696
{
9797
out << "index, " << std::setw(12);
9898
out << std::setw(maxLayerNameLength) << layerNameStr << " ";
99-
out << std::setw(12) << "Runtime"
100-
<< "%,"
101-
<< " ";
102-
out << std::setw(12) << "Invocations"
103-
<< " , ";
104-
out << std::setw(12) << "Runtime[ms]"
105-
<< " , ";
106-
out << std::setw(12) << "Avg Runtime[ms]"
107-
<< " ,";
99+
out << std::setw(12) << "Runtime" << "%," << " ";
100+
out << std::setw(12) << "Invocations" << " , ";
101+
out << std::setw(12) << "Runtime[ms]" << " , ";
102+
out << std::setw(12) << "Avg Runtime[ms]" << " ,";
108103
out << std::setw(12) << "Min Runtime[ms]" << std::endl;
109104
}
110105
int index = value.m_index;
@@ -114,8 +109,7 @@ std::ostream & operator<<(std::ostream & out, SimpleProfiler & value)
114109
out << i << ", ";
115110
out << std::setw(maxLayerNameLength) << elem.first << ",";
116111
out << std::setw(12) << std::fixed << std::setprecision(1)
117-
<< (elem.second.time * 100.0F / totalTime) << "%"
118-
<< ",";
112+
<< (elem.second.time * 100.0F / totalTime) << "%" << ",";
119113
out << std::setw(12) << elem.second.count << ",";
120114
out << std::setw(12) << std::fixed << std::setprecision(2) << elem.second.time << ", ";
121115
out << std::setw(12) << std::fixed << std::setprecision(2)

common/tensorrt_common/src/tensorrt_common.cpp

+2-4
Original file line numberDiff line numberDiff line change
@@ -302,8 +302,7 @@ void TrtCommon::printNetworkInfo(const std::string & onnx_file_path)
302302
total_gflops += gflops;
303303
total_params += num_weights;
304304
std::cout << "L" << i << " [conv " << k_dims.d[0] << "x" << k_dims.d[1] << " (" << groups
305-
<< ") "
306-
<< "/" << s_dims.d[0] << "] " << dim_in.d[3] << "x" << dim_in.d[2] << "x"
305+
<< ") " << "/" << s_dims.d[0] << "] " << dim_in.d[3] << "x" << dim_in.d[2] << "x"
307306
<< dim_in.d[1] << " -> " << dim_out.d[3] << "x" << dim_out.d[2] << "x"
308307
<< dim_out.d[1];
309308
std::cout << " weights:" << num_weights;
@@ -368,8 +367,7 @@ bool TrtCommon::buildEngineFromOnnx(
368367
if (num_available_dla > 0) {
369368
std::cout << "###" << num_available_dla << " DLAs are supported! ###" << std::endl;
370369
} else {
371-
std::cout << "###Warning : "
372-
<< "No DLA is supported! ###" << std::endl;
370+
std::cout << "###Warning : " << "No DLA is supported! ###" << std::endl;
373371
}
374372
config->setDefaultDeviceType(nvinfer1::DeviceType::kDLA);
375373
config->setDLACore(build_config_->dla_core_id);

evaluator/kinematic_evaluator/include/kinematic_evaluator/parameters.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -27,7 +27,7 @@ namespace kinematic_diagnostics
2727
struct Parameters
2828
{
2929
std::array<bool, static_cast<size_t>(Metric::SIZE)> metrics{}; // default values to false
30-
}; // struct Parameters
30+
}; // struct Parameters
3131

3232
} // namespace kinematic_diagnostics
3333

evaluator/kinematic_evaluator/test/test_kinematic_evaluator_node.cpp

+1-3
Original file line numberDiff line numberDiff line change
@@ -67,9 +67,7 @@ class EvalTest : public ::testing::Test
6767
tf_broadcaster_ = std::make_unique<tf2_ros::TransformBroadcaster>(dummy_node);
6868
}
6969

70-
~EvalTest() override
71-
{ /*rclcpp::shutdown();*/
72-
}
70+
~EvalTest() override { /*rclcpp::shutdown();*/ }
7371

7472
void setTargetMetric(kinematic_diagnostics::Metric metric)
7573
{

evaluator/localization_evaluator/include/localization_evaluator/parameters.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -27,7 +27,7 @@ namespace localization_diagnostics
2727
struct Parameters
2828
{
2929
std::array<bool, static_cast<size_t>(Metric::SIZE)> metrics{}; // default values to false
30-
}; // struct Parameters
30+
}; // struct Parameters
3131

3232
} // namespace localization_diagnostics
3333

launch/tier4_perception_launch/launch/obstacle_segmentation/ground_segmentation/ground_segmentation.launch.py

+13-9
Original file line numberDiff line numberDiff line change
@@ -501,9 +501,11 @@ def launch_setup(context, *args, **kwargs):
501501
components.extend(
502502
pipeline.create_single_frame_obstacle_segmentation_components(
503503
input_topic=LaunchConfiguration("input/pointcloud"),
504-
output_topic=pipeline.single_frame_obstacle_seg_output
505-
if pipeline.use_single_frame_filter or pipeline.use_time_series_filter
506-
else pipeline.output_topic,
504+
output_topic=(
505+
pipeline.single_frame_obstacle_seg_output
506+
if pipeline.use_single_frame_filter or pipeline.use_time_series_filter
507+
else pipeline.output_topic
508+
),
507509
)
508510
)
509511

@@ -512,18 +514,20 @@ def launch_setup(context, *args, **kwargs):
512514
components.extend(
513515
pipeline.create_single_frame_outlier_filter_components(
514516
input_topic=pipeline.single_frame_obstacle_seg_output,
515-
output_topic=relay_topic
516-
if pipeline.use_time_series_filter
517-
else pipeline.output_topic,
517+
output_topic=(
518+
relay_topic if pipeline.use_time_series_filter else pipeline.output_topic
519+
),
518520
context=context,
519521
)
520522
)
521523
if pipeline.use_time_series_filter:
522524
components.extend(
523525
pipeline.create_time_series_outlier_filter_components(
524-
input_topic=relay_topic
525-
if pipeline.use_single_frame_filter
526-
else pipeline.single_frame_obstacle_seg_output,
526+
input_topic=(
527+
relay_topic
528+
if pipeline.use_single_frame_filter
529+
else pipeline.single_frame_obstacle_seg_output
530+
),
527531
output_topic=pipeline.output_topic,
528532
)
529533
)

perception/image_projection_based_fusion/src/roi_pointcloud_fusion/node.cpp

+4-4
Original file line numberDiff line numberDiff line change
@@ -41,14 +41,14 @@ RoiPointCloudFusionNode::RoiPointCloudFusionNode(const rclcpp::NodeOptions & opt
4141
cluster_debug_pub_ = this->create_publisher<sensor_msgs::msg::PointCloud2>("debug/clusters", 1);
4242
}
4343

44-
void RoiPointCloudFusionNode::preprocess(__attribute__((unused))
45-
sensor_msgs::msg::PointCloud2 & pointcloud_msg)
44+
void RoiPointCloudFusionNode::preprocess(
45+
__attribute__((unused)) sensor_msgs::msg::PointCloud2 & pointcloud_msg)
4646
{
4747
return;
4848
}
4949

50-
void RoiPointCloudFusionNode::postprocess(__attribute__((unused))
51-
sensor_msgs::msg::PointCloud2 & pointcloud_msg)
50+
void RoiPointCloudFusionNode::postprocess(
51+
__attribute__((unused)) sensor_msgs::msg::PointCloud2 & pointcloud_msg)
5252
{
5353
const auto objects_sub_count = pub_objects_ptr_->get_subscription_count() +
5454
pub_objects_ptr_->get_intra_process_subscription_count();

perception/tensorrt_yolox/src/tensorrt_yolox.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -956,7 +956,7 @@ void TrtYoloX::generateYoloxProposals(
956956
objects.push_back(obj);
957957
}
958958
} // class loop
959-
} // point anchor loop
959+
} // point anchor loop
960960
}
961961

962962
void TrtYoloX::qsortDescentInplace(ObjectArray & face_objects, int left, int right) const

planning/behavior_path_avoidance_module/src/debug.cpp

+1-2
Original file line numberDiff line numberDiff line change
@@ -240,8 +240,7 @@ MarkerArray createEgoStatusMarkerArray(
240240
std::ostringstream string_stream;
241241
string_stream << std::fixed << std::setprecision(2) << std::boolalpha;
242242
string_stream << "avoid_req:" << data.avoid_required << ","
243-
<< "yield_req:" << data.yield_required << ","
244-
<< "safe:" << data.safe;
243+
<< "yield_req:" << data.yield_required << "," << "safe:" << data.safe;
245244
marker.text = string_stream.str();
246245

247246
msg.markers.push_back(marker);

planning/behavior_path_planner/src/planner_manager.cpp

+2-4
Original file line numberDiff line numberDiff line change
@@ -953,15 +953,13 @@ void PlannerManager::print() const
953953
string_stream << "\n";
954954
string_stream << "approved modules : ";
955955
for (const auto & m : approved_module_ptrs_) {
956-
string_stream << "[" << m->name() << "(" << get_status(m) << ")"
957-
<< "]->";
956+
string_stream << "[" << m->name() << "(" << get_status(m) << ")" << "]->";
958957
}
959958

960959
string_stream << "\n";
961960
string_stream << "candidate module : ";
962961
for (const auto & m : candidate_module_ptrs_) {
963-
string_stream << "[" << m->name() << "(" << get_status(m) << ")"
964-
<< "]->";
962+
string_stream << "[" << m->name() << "(" << get_status(m) << ")" << "]->";
965963
}
966964

967965
string_stream << "\n";

planning/freespace_planning_algorithms/test/src/test_freespace_planning_algorithms.cpp

+1-2
Original file line numberDiff line numberDiff line change
@@ -306,8 +306,7 @@ bool test_algorithm(enum AlgorithmType algo_type, bool dump_rosbag = false)
306306
cost = algo->getWaypoints().compute_length();
307307
}
308308

309-
std::cout << "plan success : " << msec << "[msec]"
310-
<< ", solution cost : " << cost << std::endl;
309+
std::cout << "plan success : " << msec << "[msec]" << ", solution cost : " << cost << std::endl;
311310
const auto result = algo->getWaypoints();
312311
geometry_msgs::msg::PoseArray trajectory;
313312
for (const auto & pose : result.waypoints) {

planning/mission_planner/src/lanelet2_plugins/default_planner.cpp

+1-2
Original file line numberDiff line numberDiff line change
@@ -391,8 +391,7 @@ PlannerPlugin::LaneletRoute DefaultPlanner::plan(const RoutePoints & points)
391391

392392
std::stringstream log_ss;
393393
for (const auto & point : points) {
394-
log_ss << "x: " << point.position.x << " "
395-
<< "y: " << point.position.y << std::endl;
394+
log_ss << "x: " << point.position.x << " " << "y: " << point.position.y << std::endl;
396395
}
397396
RCLCPP_DEBUG_STREAM(
398397
logger, "start planning route with check points: " << std::endl

planning/sampling_based_planner/frenet_planner/include/frenet_planner/structures.hpp

+1-2
Original file line numberDiff line numberDiff line change
@@ -141,8 +141,7 @@ struct Trajectory : sampler_common::Trajectory
141141
inline std::ostream & operator<<(std::ostream & os, const SamplingParameter & sp)
142142
{
143143
const auto & s = sp.target_state;
144-
return os << "["
145-
<< "T=" << sp.target_duration << ", s=" << s.position.s << ", d=" << s.position.d
144+
return os << "[" << "T=" << sp.target_duration << ", s=" << s.position.s << ", d=" << s.position.d
146145
<< ", s'=" << s.longitudinal_velocity << ", d'=" << s.lateral_velocity
147146
<< ", s\"=" << s.longitudinal_acceleration << ", d\"=" << s.lateral_acceleration << "]";
148147
}

planning/sampling_based_planner/path_sampler/src/node.cpp

+1-2
Original file line numberDiff line numberDiff line change
@@ -421,8 +421,7 @@ std::vector<TrajectoryPoint> PathSampler::generatePath(const PlannerData & plann
421421
size_t reuse_idx = 0;
422422
for (reuse_idx = 0; reuse_idx + 1 < prev_path_->lengths.size() &&
423423
prev_path_->lengths[reuse_idx] < reuse_length;
424-
++reuse_idx)
425-
;
424+
++reuse_idx);
426425
if (reuse_idx == 0UL) continue;
427426
const auto reused_path = *prev_path_->subset(0UL, reuse_idx);
428427
reuse_state.curvature = reused_path.curvatures.back();

sensing/pointcloud_preprocessor/src/passthrough_filter/passthrough_uint16.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -242,7 +242,7 @@ void pcl::PassThroughUInt16<pcl::PCLPointCloud2>::applyFilter(PCLPointCloud2 & o
242242
nr_p++;
243243
}
244244
output.width = nr_p;
245-
} // !keep_organized_
245+
} // !keep_organized_
246246
} else { // No distance filtering, process all data.
247247
// No need to check for is_organized here as we did it above
248248
for (int cp = 0; cp < nr_points; ++cp, xyz_offset += input_->point_step) {

sensing/pointcloud_preprocessor/src/vector_map_filter/lanelet2_map_filter_nodelet.cpp

+1-3
Original file line numberDiff line numberDiff line change
@@ -226,9 +226,7 @@ void Lanelet2MapFilterComponent::pointcloudCallback(const PointCloud2ConstPtr cl
226226
if (!transformPointCloud("map", cloud_msg, input_transformed_cloud_ptr.get())) {
227227
RCLCPP_ERROR_STREAM_THROTTLE(
228228
this->get_logger(), *this->get_clock(), std::chrono::milliseconds(10000).count(),
229-
"Failed transform from "
230-
<< "map"
231-
<< " to " << cloud_msg->header.frame_id);
229+
"Failed transform from " << "map" << " to " << cloud_msg->header.frame_id);
232230
return;
233231
}
234232
pcl::PointCloud<pcl::PointXYZ>::Ptr cloud(new pcl::PointCloud<pcl::PointXYZ>);

sensing/tier4_pcl_extensions/include/tier4_pcl_extensions/voxel_grid_nearest_centroid_impl.hpp

+2-2
Original file line numberDiff line numberDiff line change
@@ -221,7 +221,7 @@ void pcl::VoxelGridNearestCentroid<PointT>::applyFilter(PointCloud & output)
221221
&rgb, reinterpret_cast<const char *>(&input_->points[cp]) + rgba_index, sizeof(int));
222222
centroid[centroid_size - 3] = static_cast<float>((rgb >> 16) & 0x0000ff);
223223
centroid[centroid_size - 2] = static_cast<float>((rgb >> 8) & 0x0000ff);
224-
centroid[centroid_size - 1] = static_cast<float>((rgb)&0x0000ff);
224+
centroid[centroid_size - 1] = static_cast<float>((rgb) & 0x0000ff);
225225
}
226226
pcl::for_each_type<FieldList>(
227227
NdCopyPointEigenFunctor<PointT>(input_->points[cp], centroid));
@@ -272,7 +272,7 @@ void pcl::VoxelGridNearestCentroid<PointT>::applyFilter(PointCloud & output)
272272
&rgb, reinterpret_cast<const char *>(&input_->points[cp]) + rgba_index, sizeof(int));
273273
centroid[centroid_size - 3] = static_cast<float>((rgb >> 16) & 0x0000ff);
274274
centroid[centroid_size - 2] = static_cast<float>((rgb >> 8) & 0x0000ff);
275-
centroid[centroid_size - 1] = static_cast<float>((rgb)&0x0000ff);
275+
centroid[centroid_size - 1] = static_cast<float>((rgb) & 0x0000ff);
276276
}
277277
pcl::for_each_type<FieldList>(
278278
NdCopyPointEigenFunctor<PointT>(input_->points[cp], centroid));

system/system_monitor/include/system_monitor/cpu_monitor/raspi_cpu_monitor.hpp

+10-10
Original file line numberDiff line numberDiff line change
@@ -35,16 +35,16 @@
3535

3636
#define raspiThermalThrottlingMask (raspiCurrentlyThrottled | raspiSoftTemperatureLimitActive)
3737

38-
#define throttledToString(X) \
39-
(((X)&raspiUnderVoltageDetected) ? "Under-voltage detected" \
40-
: ((X)&raspiArmFrequencyCapped) ? "Arm frequency capped" \
41-
: ((X)&raspiCurrentlyThrottled) ? "Currently throttled" \
42-
: ((X)&raspiSoftTemperatureLimitActive) ? "Soft temperature limit active" \
43-
: ((X)&raspiUnderVoltageHasOccurred) ? "Under-voltage has occurred" \
44-
: ((X)&raspiArmFrequencyCappedHasOccurred) ? "Arm frequency capped has occurred" \
45-
: ((X)&raspiThrottlingHasOccurred) ? "Throttling has occurred" \
46-
: ((X)&raspiSoftTemperatureLimitHasOccurred) ? "Soft temperature limit has occurred" \
47-
: "UNKNOWN")
38+
#define throttledToString(X) \
39+
(((X) & raspiUnderVoltageDetected) ? "Under-voltage detected" \
40+
: ((X) & raspiArmFrequencyCapped) ? "Arm frequency capped" \
41+
: ((X) & raspiCurrentlyThrottled) ? "Currently throttled" \
42+
: ((X) & raspiSoftTemperatureLimitActive) ? "Soft temperature limit active" \
43+
: ((X) & raspiUnderVoltageHasOccurred) ? "Under-voltage has occurred" \
44+
: ((X) & raspiArmFrequencyCappedHasOccurred) ? "Arm frequency capped has occurred" \
45+
: ((X) & raspiThrottlingHasOccurred) ? "Throttling has occurred" \
46+
: ((X) & raspiSoftTemperatureLimitHasOccurred) ? "Soft temperature limit has occurred" \
47+
: "UNKNOWN")
4848

4949
class CPUMonitor : public CPUMonitorBase
5050
{

system/system_monitor/include/system_monitor/gpu_monitor/nvml_gpu_monitor.hpp

+11-11
Original file line numberDiff line numberDiff line change
@@ -29,17 +29,17 @@
2929
#include <string>
3030
#include <vector>
3131

32-
#define reasonToString(X) \
33-
(((X)&nvmlClocksThrottleReasonGpuIdle) ? "GpuIdle" \
34-
: ((X)&nvmlClocksThrottleReasonApplicationsClocksSetting) ? "ApplicationsClocksSetting" \
35-
: ((X)&nvmlClocksThrottleReasonSwPowerCap) ? "SwPowerCap" \
36-
: ((X)&nvmlClocksThrottleReasonHwSlowdown) ? "HwSlowdown" \
37-
: ((X)&nvmlClocksThrottleReasonSyncBoost) ? "SyncBoost" \
38-
: ((X)&nvmlClocksThrottleReasonSwThermalSlowdown) ? "SwThermalSlowdown" \
39-
: ((X)&nvmlClocksThrottleReasonHwThermalSlowdown) ? "HwThermalSlowdown" \
40-
: ((X)&nvmlClocksThrottleReasonHwPowerBrakeSlowdown) ? "HwPowerBrakeSlowdown" \
41-
: ((X)&nvmlClocksThrottleReasonDisplayClockSetting) ? "DisplayClockSetting" \
42-
: "UNKNOWN")
32+
#define reasonToString(X) \
33+
(((X) & nvmlClocksThrottleReasonGpuIdle) ? "GpuIdle" \
34+
: ((X) & nvmlClocksThrottleReasonApplicationsClocksSetting) ? "ApplicationsClocksSetting" \
35+
: ((X) & nvmlClocksThrottleReasonSwPowerCap) ? "SwPowerCap" \
36+
: ((X) & nvmlClocksThrottleReasonHwSlowdown) ? "HwSlowdown" \
37+
: ((X) & nvmlClocksThrottleReasonSyncBoost) ? "SyncBoost" \
38+
: ((X) & nvmlClocksThrottleReasonSwThermalSlowdown) ? "SwThermalSlowdown" \
39+
: ((X) & nvmlClocksThrottleReasonHwThermalSlowdown) ? "HwThermalSlowdown" \
40+
: ((X) & nvmlClocksThrottleReasonHwPowerBrakeSlowdown) ? "HwPowerBrakeSlowdown" \
41+
: ((X) & nvmlClocksThrottleReasonDisplayClockSetting) ? "DisplayClockSetting" \
42+
: "UNKNOWN")
4343

4444
/**
4545
* @brief GPU information

vehicle/accel_brake_map_calibrator/src/accel_brake_map_calibrator_node.cpp

+8-11
Original file line numberDiff line numberDiff line change
@@ -286,15 +286,14 @@ void AccelBrakeMapCalibrator::timerCallback()
286286
"map updating... count: " << update_success_count_ << " / " << update_count_ << "\n\t"
287287
<< "lack_of_data_count: " << lack_of_data_count_ << "\n\t"
288288
<< " failed_to_get_pitch_count: " << failed_to_get_pitch_count_
289+
<< "\n\t" << "too_large_pitch_count: " << too_large_pitch_count_
290+
<< "\n\t" << " too_low_speed_count: " << too_low_speed_count_
291+
<< "\n\t" << "too_large_steer_count: " << too_large_steer_count_
292+
<< "\n\t" << "too_large_jerk_count: " << too_large_jerk_count_
293+
<< "\n\t" << "invalid_acc_brake_count: " << invalid_acc_brake_count_
289294
<< "\n\t"
290-
<< "too_large_pitch_count: " << too_large_pitch_count_ << "\n\t"
291-
<< " too_low_speed_count: " << too_low_speed_count_ << "\n\t"
292-
<< "too_large_steer_count: " << too_large_steer_count_ << "\n\t"
293-
<< "too_large_jerk_count: " << too_large_jerk_count_ << "\n\t"
294-
<< "invalid_acc_brake_count: " << invalid_acc_brake_count_ << "\n\t"
295295
<< "too_large_pedal_spd_count: " << too_large_pedal_spd_count_
296-
<< "\n\t"
297-
<< "update_fail_count_: " << update_fail_count_ << "\n");
296+
<< "\n\t" << "update_fail_count_: " << update_fail_count_ << "\n");
298297

299298
/* valid check */
300299

@@ -1031,8 +1030,7 @@ bool AccelBrakeMapCalibrator::updateEachValOffset(
10311030
RCLCPP_DEBUG_STREAM(
10321031
get_logger(), "index: " << ped_idx << ", " << vel_idx
10331032
<< ": map_offset_ = " << map_offset_vec_.at(ped_idx).at(vel_idx)
1034-
<< " -> " << map_offset << "\t"
1035-
<< " covariance = " << covariance);
1033+
<< " -> " << map_offset << "\t" << " covariance = " << covariance);
10361034

10371035
/* input calculated result and update map */
10381036
map_offset_vec_.at(ped_idx).at(vel_idx) = map_offset;
@@ -1060,8 +1058,7 @@ void AccelBrakeMapCalibrator::updateTotalMapOffset(const double measured_acc, co
10601058
map_offset_ = map_offset_ + coef * error_map_offset;
10611059

10621060
RCLCPP_DEBUG_STREAM(
1063-
get_logger(), "map_offset_ = " << map_offset_ << "\t"
1064-
<< "covariance = " << covariance_);
1061+
get_logger(), "map_offset_ = " << map_offset_ << "\t" << "covariance = " << covariance_);
10651062

10661063
/* update map */
10671064
for (std::size_t ped_idx = 0; ped_idx < update_accel_map_value_.size() - 1; ped_idx++) {

0 commit comments

Comments
 (0)