Skip to content

Commit

Permalink
Fix style issues.
Browse files Browse the repository at this point in the history
Signed-off-by: Chris Lalancette <[email protected]>
  • Loading branch information
clalancette committed Jan 4, 2022
1 parent cc79818 commit e3264cb
Show file tree
Hide file tree
Showing 2 changed files with 3 additions and 3 deletions.
2 changes: 1 addition & 1 deletion rclcpp/include/rclcpp/any_subscription_callback.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -486,7 +486,7 @@ class AnySubscriptionCallback
return std::unique_ptr<ROSMessageType, ROSMessageTypeDeleter>(ptr, ros_message_type_deleter_);
} else {
static_assert(
!sizeof(MessageT*),
!sizeof(MessageT *),
"convert_custom_type_to_ros_message_unique_ptr() "
"unexpectedly called without specialized TypeAdapter");
}
Expand Down
4 changes: 2 additions & 2 deletions rclcpp/test/rclcpp/test_publisher_with_type_adapter.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -181,8 +181,8 @@ TEST_F(TestPublisher, conversion_exception_is_passed_up) {

initialize(options);
auto pub = node->create_publisher<BadStringTypeAdapter>("topic_name", 1);
//A subscription is created to ensure the existence of a buffer in the intra proccess
//manager which will trigger the faulty conversion.
// A subscription is created to ensure the existence of a buffer in the intra proccess
// manager which will trigger the faulty conversion.
auto sub = node->create_subscription<rclcpp::msg::String>("topic_name", 1, callback);
EXPECT_THROW(pub->publish(1), std::runtime_error);
}
Expand Down

0 comments on commit e3264cb

Please sign in to comment.