From ea7a809b94e282d9221fafb3bb1addeec3e65720 Mon Sep 17 00:00:00 2001 From: Jacob Perron Date: Fri, 12 Jun 2020 10:42:40 -0700 Subject: [PATCH] Fix typo from rebase Signed-off-by: Jacob Perron --- gazebo_plugins/src/gazebo_ros_camera.cpp | 2 +- 1 file changed, 1 insertion(+), 1 deletion(-) diff --git a/gazebo_plugins/src/gazebo_ros_camera.cpp b/gazebo_plugins/src/gazebo_ros_camera.cpp index 6d86121c0..b45034ee7 100644 --- a/gazebo_plugins/src/gazebo_ros_camera.cpp +++ b/gazebo_plugins/src/gazebo_ros_camera.cpp @@ -182,7 +182,7 @@ void GazeboRosCamera::Load(gazebo::sensors::SensorPtr _sensor, sdf::ElementPtr _ image_transport::create_publisher( impl_->ros_node_.get(), camera_topic, - qos.get_publisher_qos(camera_topic, rclcpp::SensorDataQos()).get_rmw_qos_profile())); + qos.get_publisher_qos(camera_topic, rclcpp::SensorDataQoS()).get_rmw_qos_profile())); // TODO(louise) Uncomment this once image_transport::Publisher has a function to return the // full topic.