Skip to content

Commit

Permalink
moar
Browse files Browse the repository at this point in the history
  • Loading branch information
SteveMacenski committed Jan 10, 2024
1 parent 3c76358 commit 20382e9
Show file tree
Hide file tree
Showing 4 changed files with 5 additions and 5 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -163,7 +163,7 @@ class Tester : public ::testing::Test

// CollisionMonitor collision points markers
rclcpp::Subscription<visualization_msgs::msg::MarkerArray>::SharedPtr
collision_points_marker_sub_;
collision_points_marker_sub_;
visualization_msgs::msg::MarkerArray::SharedPtr collision_points_marker_msg_;
}; // Tester

Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -196,7 +196,7 @@ class Tester : public ::testing::Test

// CollisionMonitor collision points markers
rclcpp::Subscription<visualization_msgs::msg::MarkerArray>::SharedPtr
collision_points_marker_sub_;
collision_points_marker_sub_;
visualization_msgs::msg::MarkerArray::SharedPtr collision_points_marker_msg_;

// Service client for setting CollisionMonitor parameters
Expand Down
4 changes: 2 additions & 2 deletions nav2_costmap_2d/test/regression/plugin_api_order.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -16,8 +16,8 @@
#include <vector>
#include <memory>

#include <gtest/gtest.h>
#include <nav2_costmap_2d/costmap_2d_ros.hpp>
#include "gtest/gtest.h"
#include "nav2_costmap_2d/costmap_2d_ros.hpp"

TEST(CostmapPluginsTester, checkPluginAPIOrder)
{
Expand Down
2 changes: 1 addition & 1 deletion nav2_simple_commander/nav2_simple_commander/costmap_2d.py
Original file line number Diff line number Diff line change
Expand Up @@ -37,7 +37,7 @@ def __init__(self, occupancy_map):
"""
Initialize costmap2D.
Args
Args:
----
occupancy_map (OccupancyGrid): 2D OccupancyGrid Map
Expand Down

0 comments on commit 20382e9

Please sign in to comment.