Skip to content

Commit

Permalink
typo fixed
Browse files Browse the repository at this point in the history
Signed-off-by: goes <[email protected]>
  • Loading branch information
goes authored and goes committed May 6, 2024
1 parent b3e8d55 commit 9538f42
Show file tree
Hide file tree
Showing 2 changed files with 3 additions and 3 deletions.
2 changes: 1 addition & 1 deletion nav2_util/include/nav2_util/validate_messages.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -131,7 +131,7 @@ bool validateMsg(const geometry_msgs::msg::PoseWithCovariance & msg)
return true;
}

bool validateMsg(const geometry_msgs::msg::PoseWithCovarianceStamped & msg)
bool validateMsg(const geometry_msgs::PoseWithCovarianceStamped_ & msg)
{
// check sub-type
if (!validateMsg(msg.header)) {return false;}
Expand Down
4 changes: 2 additions & 2 deletions nav2_util/test/test_validation_messages.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -294,7 +294,7 @@ TEST(ValidateMessagesTest, PoseWithCovarianceCheck) {


TEST(ValidateMessagesTest, PoseWithCovarianceStampedCheck) {
geometry_msgs::msg::PoseWithCovarianceStamped validate_msg = {
geometry_msgs::msg::PoseWithCovarianceStamped_ validate_msg = {
// Header
{
// frame_id
Expand Down Expand Up @@ -322,7 +322,7 @@ TEST(ValidateMessagesTest, PoseWithCovarianceStampedCheck) {
};
EXPECT_TRUE(nav2_util::validateMsg(validate_msg));

geometry_msgs::msg::PoseWithCovarianceStamped
geometry_msgs::msg::PoseWithCovarianceStamped_
invalidate_msg = {
// Header
{
Expand Down

0 comments on commit 9538f42

Please sign in to comment.