Skip to content

Commit

Permalink
uncrustify
Browse files Browse the repository at this point in the history
Signed-off-by: Knese Karsten <karsten@openrobotics.org>
  • Loading branch information
Karsten1987 committed Oct 11, 2019
1 parent aaf8070 commit d6374e3
Show file tree
Hide file tree
Showing 2 changed files with 3 additions and 3 deletions.
4 changes: 2 additions & 2 deletions rclcpp/include/rclcpp/loaned_message.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -73,8 +73,8 @@ class LoanedMessage
message_ = static_cast<MessageT *>(message_ptr);
} else {
RCLCPP_INFO_ONCE(
rclcpp::get_logger("rclcpp"),
"Currently used middleware can't loan messages. Local allocator will be used.");
rclcpp::get_logger("rclcpp"),
"Currently used middleware can't loan messages. Local allocator will be used.");
message_ = message_allocator_.allocate(1);
new (message_) MessageT();
}
Expand Down
2 changes: 1 addition & 1 deletion rclcpp/include/rclcpp/subscription.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -184,7 +184,7 @@ class Subscription : public SubscriptionBase
auto typed_message = static_cast<CallbackMessageT *>(loaned_message);
// message is loaned, so we have to make sure that the deleter does not deallocate the message
auto sptr = std::shared_ptr<CallbackMessageT>(
typed_message, [](CallbackMessageT * msg) { (void) msg; });
typed_message, [](CallbackMessageT * msg) {(void) msg;});
any_callback_.dispatch(sptr, message_info);
}

Expand Down

0 comments on commit d6374e3

Please sign in to comment.