Skip to content

Commit 37aa162

Browse files
fmauchchristophfroehlich
authored andcommitted
use reset+initRT due to missing writeFromRT
Co-authored-by: Christoph Fröhlich <[email protected]>
1 parent 69d8194 commit 37aa162

File tree

1 file changed

+2
-1
lines changed

1 file changed

+2
-1
lines changed

joint_trajectory_controller/src/joint_trajectory_controller.cpp

Lines changed: 2 additions & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -184,7 +184,8 @@ controller_interface::return_type JointTrajectoryController::update(
184184
time_data.uptime = time_data_.readFromRT()->uptime + time_data.period;
185185
rclcpp::Time traj_time =
186186
time_data_.readFromRT()->uptime + rclcpp::Duration::from_nanoseconds(t_period);
187-
time_data_.writeFromNonRT(time_data);
187+
time_data_.reset();
188+
time_data_.initRT(time_data);
188189

189190
bool first_sample = false;
190191
// if sampling the first time, set the point before you sample

0 commit comments

Comments
 (0)