Skip to content

Commit

Permalink
gazebo_ros_control: default_robot_hw_sim: Suppressing pid error messa…
Browse files Browse the repository at this point in the history
  • Loading branch information
jbohren committed May 26, 2014
1 parent b353b4a commit 4776545
Showing 1 changed file with 1 addition and 1 deletion.
2 changes: 1 addition & 1 deletion gazebo_ros_control/src/default_robot_hw_sim.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -217,7 +217,7 @@ class DefaultRobotHWSim : public gazebo_ros_control::RobotHWSim
// joint->SetVelocity() to control the joint.
const ros::NodeHandle nh(model_nh, robot_namespace + "/gazebo_ros_control/pid_gains/" +
joint_names_[j]);
if (pid_controllers_[j].init(nh))
if (pid_controllers_[j].init(nh,true))
{
switch (joint_control_methods_[j])
{
Expand Down

0 comments on commit 4776545

Please sign in to comment.