Skip to content

Commit

Permalink
Less exciting console output (#549)
Browse files Browse the repository at this point in the history
  • Loading branch information
davetcoleman authored and j-rivero committed Feb 27, 2017
1 parent 0843acc commit c6c1b21
Show file tree
Hide file tree
Showing 2 changed files with 2 additions and 2 deletions.
2 changes: 1 addition & 1 deletion gazebo_plugins/src/gazebo_ros_planar_move.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -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_);
Expand Down
2 changes: 1 addition & 1 deletion gazebo_plugins/src/gazebo_ros_video.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -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;

Expand Down

0 comments on commit c6c1b21

Please sign in to comment.