File tree Expand file tree Collapse file tree 1 file changed +0
-4
lines changed
nav2_docking/opennav_docking/src Expand file tree Collapse file tree 1 file changed +0
-4
lines changed Original file line number Diff line number Diff line change @@ -130,8 +130,6 @@ geometry_msgs::msg::Twist Controller::computeRotateToHeadingCommand(
130130 const geometry_msgs::msg::Twist & current_velocity,
131131 const double & dt)
132132{
133- std::lock_guard<std::mutex> lock (dynamic_params_lock_);
134-
135133 geometry_msgs::msg::Twist cmd_vel;
136134 const double sign = angular_distance_to_heading > 0.0 ? 1.0 : -1.0 ;
137135 const double angular_vel = sign * rotate_to_heading_angular_vel_;
@@ -155,8 +153,6 @@ geometry_msgs::msg::Twist Controller::computeRotateToHeadingCommand(
155153bool Controller::isTrajectoryCollisionFree (
156154 const geometry_msgs::msg::Pose & target_pose, bool is_docking, bool backward)
157155{
158- std::lock_guard<std::mutex> lock (dynamic_params_lock_);
159-
160156 // Visualization of the trajectory
161157 nav_msgs::msg::Path trajectory;
162158 trajectory.header .frame_id = base_frame_;
You can’t perform that action at this time.
0 commit comments