Skip to content

Commit 9021434

Browse files
committed
Removed access to deleted PidState fields in pub
Remove references to the fields that were deleted from the PidState.msg in the publish function, ensuring consistency between the message definition and its usage.
1 parent ba7fddb commit 9021434

File tree

1 file changed

+0
-1
lines changed

1 file changed

+0
-1
lines changed

src/pid_ros.cpp

-1
Original file line numberDiff line numberDiff line change
@@ -351,7 +351,6 @@ void PidROS::publish_pid_state(double cmd, double error, rclcpp::Duration dt)
351351
rt_state_pub_->msg_.p_gain = gains.p_gain_;
352352
rt_state_pub_->msg_.i_gain = gains.i_gain_;
353353
rt_state_pub_->msg_.d_gain = gains.d_gain_;
354-
rt_state_pub_->msg_.trk_tc = gains.trk_tc_;
355354
rt_state_pub_->msg_.output = cmd;
356355
rt_state_pub_->unlockAndPublish();
357356
}

0 commit comments

Comments
 (0)