Skip to content

Commit

Permalink
chore: Fix typo
Browse files Browse the repository at this point in the history
Co-authored-by: Kotaro Uetake <[email protected]>
Signed-off-by: KhalilSelyan <[email protected]>
  • Loading branch information
KhalilSelyan and ktro2828 committed May 29, 2024
1 parent ec76a55 commit 0de9203
Show file tree
Hide file tree
Showing 2 changed files with 2 additions and 2 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -317,7 +317,7 @@ class AUTOWARE_AUTO_PERCEPTION_RVIZ_PLUGIN_PUBLIC ObjectPolygonDisplayBase
try {
rclcpp::SubscriptionOptions sub_opts;
sub_opts.event_callbacks.message_lost_callback = [&](rclcpp::QOSMessageLostInfo & info) {
std::ostringstream sstm;
std::ostringstream sstream;
sstm << "Some messages were lost:\n>\tNumber of new lost messages: "
<< info.total_count_change
<< " \n>\tTotal number of messages lost: " << info.total_count;
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -161,7 +161,7 @@ void DetectedObjectsDisplay::processMessage(DetectedObjects::ConstSharedPtr msg)
if (pointCloudBuffer.empty()) {
return;
}
// poincloud pub
// pointcloud pub
sensor_msgs::msg::PointCloud2::ConstSharedPtr closest_pointcloud =
std::make_shared<sensor_msgs::msg::PointCloud2>(
getNearestPointCloud(pointCloudBuffer, msg->header.stamp));
Expand Down

0 comments on commit 0de9203

Please sign in to comment.