From c6c1b2190d9bdd1503ba2396d8314bf34199b657 Mon Sep 17 00:00:00 2001 From: Dave Coleman Date: Mon, 27 Feb 2017 07:28:19 -0700 Subject: [PATCH] Less exciting console output (#549) --- gazebo_plugins/src/gazebo_ros_planar_move.cpp | 2 +- gazebo_plugins/src/gazebo_ros_video.cpp | 2 +- 2 files changed, 2 insertions(+), 2 deletions(-) diff --git a/gazebo_plugins/src/gazebo_ros_planar_move.cpp b/gazebo_plugins/src/gazebo_ros_planar_move.cpp index 3d7a1d678..dc770809a 100644 --- a/gazebo_plugins/src/gazebo_ros_planar_move.cpp +++ b/gazebo_plugins/src/gazebo_ros_planar_move.cpp @@ -130,7 +130,7 @@ namespace gazebo } rosnode_.reset(new ros::NodeHandle(robot_namespace_)); - ROS_DEBUG_NAMED("planar_move", "OCPlugin (%s) has started!", + ROS_DEBUG_NAMED("planar_move", "OCPlugin (%s) has started", robot_namespace_.c_str()); tf_prefix_ = tf::getPrefixParam(*rosnode_); diff --git a/gazebo_plugins/src/gazebo_ros_video.cpp b/gazebo_plugins/src/gazebo_ros_video.cpp index dd64233fb..8bb8bfe01 100644 --- a/gazebo_plugins/src/gazebo_ros_video.cpp +++ b/gazebo_plugins/src/gazebo_ros_video.cpp @@ -198,7 +198,7 @@ namespace gazebo ros::VoidPtr(), &queue_); camera_subscriber_ = rosnode_->subscribe(so); - ROS_INFO_NAMED("video", "GazeboRosVideo (%s, ns = %s) has started!", + ROS_INFO_NAMED("video", "GazeboRosVideo (%s, ns = %s) has started", gazebo_source.c_str(), robot_namespace_.c_str()); new_image_available_ = false;