File tree Expand file tree Collapse file tree 1 file changed +7
-0
lines changed
nav2_controller/include/nav2_controller Expand file tree Collapse file tree 1 file changed +7
-0
lines changed Original file line number Diff line number Diff line change @@ -173,6 +173,10 @@ class ControllerServer : public nav2::LifecycleNode
173
173
* @param velocity Twist velocity to be published
174
174
*/
175
175
void publishVelocity (const geometry_msgs::msg::TwistStamped & velocity);
176
+ /* *
177
+ * @brief Calculates and publishes the TrackingError's all components
178
+ */
179
+ void publishTrackingState ();
176
180
/* *
177
181
* @brief Calls velocity publisher to publish zero velocity
178
182
*/
@@ -237,6 +241,7 @@ class ControllerServer : public nav2::LifecycleNode
237
241
std::unique_ptr<nav2_util::OdomSmoother> odom_sub_;
238
242
std::unique_ptr<nav2_util::TwistPublisher> vel_publisher_;
239
243
nav2::Subscription<nav2_msgs::msg::SpeedLimit>::SharedPtr speed_limit_sub_;
244
+ rclcpp::Publisher<nav2_msgs::msg::TrackingError>::SharedPtr tracking_error_pub_;
240
245
241
246
// Progress Checker Plugin
242
247
pluginlib::ClassLoader<nav2_core::ProgressChecker> progress_checker_loader_;
@@ -269,6 +274,8 @@ class ControllerServer : public nav2::LifecycleNode
269
274
double min_x_velocity_threshold_;
270
275
double min_y_velocity_threshold_;
271
276
double min_theta_velocity_threshold_;
277
+ double search_window_;
278
+ int start_index_;
272
279
273
280
double failure_tolerance_;
274
281
bool use_realtime_priority_;
You can’t perform that action at this time.
0 commit comments