Skip to content

Commit fc435e9

Browse files
authored
Removed outdated comment (#319)
Signed-off-by: Alejandro Hernández Cordero <ahcorde@gmail.com>
1 parent 26db73e commit fc435e9

File tree

1 file changed

+0
-2
lines changed

1 file changed

+0
-2
lines changed

image_transport/src/publisher.cpp

Lines changed: 0 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -174,7 +174,6 @@ std::string Publisher::getTopic() const
174174
void Publisher::publish(const sensor_msgs::msg::Image & message) const
175175
{
176176
if (!impl_ || !impl_->isValid()) {
177-
// TODO(ros2) Switch to RCUTILS_ASSERT when ros2/rcutils#112 is merged
178177
auto logger = impl_ ? impl_->logger_ : rclcpp::get_logger("image_transport");
179178
RCLCPP_FATAL(logger, "Call to publish() on an invalid image_transport::Publisher");
180179
return;
@@ -190,7 +189,6 @@ void Publisher::publish(const sensor_msgs::msg::Image & message) const
190189
void Publisher::publish(const sensor_msgs::msg::Image::ConstSharedPtr & message) const
191190
{
192191
if (!impl_ || !impl_->isValid()) {
193-
// TODO(ros2) Switch to RCUTILS_ASSERT when ros2/rcutils#112 is merged
194192
auto logger = impl_ ? impl_->logger_ : rclcpp::get_logger("image_transport");
195193
RCLCPP_FATAL(logger, "Call to publish() on an invalid image_transport::Publisher");
196194
return;

0 commit comments

Comments
 (0)