Skip to content

Commit 0de9203

Browse files
KhalilSelyanktro2828
KhalilSelyan
andcommitted
chore: Fix typo
Co-authored-by: Kotaro Uetake <60615504+ktro2828@users.noreply.github.com> Signed-off-by: KhalilSelyan <khalil@leodrive.ai>
1 parent ec76a55 commit 0de9203

File tree

2 files changed

+2
-2
lines changed

2 files changed

+2
-2
lines changed

common/autoware_auto_perception_rviz_plugin/include/autoware_auto_perception_rviz_plugin/object_detection/object_polygon_display_base.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -317,7 +317,7 @@ class AUTOWARE_AUTO_PERCEPTION_RVIZ_PLUGIN_PUBLIC ObjectPolygonDisplayBase
317317
try {
318318
rclcpp::SubscriptionOptions sub_opts;
319319
sub_opts.event_callbacks.message_lost_callback = [&](rclcpp::QOSMessageLostInfo & info) {
320-
std::ostringstream sstm;
320+
std::ostringstream sstream;
321321
sstm << "Some messages were lost:\n>\tNumber of new lost messages: "
322322
<< info.total_count_change
323323
<< " \n>\tTotal number of messages lost: " << info.total_count;

common/autoware_auto_perception_rviz_plugin/src/object_detection/detected_objects_display.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -161,7 +161,7 @@ void DetectedObjectsDisplay::processMessage(DetectedObjects::ConstSharedPtr msg)
161161
if (pointCloudBuffer.empty()) {
162162
return;
163163
}
164-
// poincloud pub
164+
// pointcloud pub
165165
sensor_msgs::msg::PointCloud2::ConstSharedPtr closest_pointcloud =
166166
std::make_shared<sensor_msgs::msg::PointCloud2>(
167167
getNearestPointCloud(pointCloudBuffer, msg->header.stamp));

0 commit comments

Comments
 (0)