Skip to content

Commit 3e02320

Browse files
TomohitoAndosoblinmiurshtechnolojinpre-commit-ci[bot]
authored
Merge pull request #1186 from tier4/cherry-pick-improve-tracker
* chore(build): remove tier4_autoware_utils.hpp perception/ (autowarefoundation#4843) removed tier4_autoware_utils.hpp in perception/ Signed-off-by: Mamoru Sobue <mamoru.sobue@tier4.jp> Co-authored-by: Shunsuke Miura <37187849+miursh@users.noreply.github.com> * feat(multi_object_tracker): mot bicycle model revision (autowarefoundation#6082) * fix: bicycle model length on big vehicle Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> * fix: rear axis position fix in all modalities Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> * fix: repeat predict to limit dt Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> * fix: implement repeating prediction to all modalities Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> * fix: bicycle model revision Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> * fix: fix centripetal acceleration, jacobian Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> * style(pre-commit): autofix Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> * chore: equation on description, velocity index fix Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> * fix: markdown math Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> * chore: refactor params Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> * feat: model slip process rate Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> * feat: yaw rate limits Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> * chore: refactor vx to vel, follow actual definition Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> * fix: acceleration uncertainty equation fix Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> * fix: twist covariance matrix Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> * chore: explanations of Kalman filter matrices Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> * feat: slip angle process noise model revised Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> * feat: parameter tuning Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> * fix: use mahalanobis distance gate with larger threshold Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> * chore: align tracker format Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> * style(pre-commit): autofix --------- Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yoshi Ri <yoshiyoshidetteiu@gmail.com> Co-authored-by: Kotaro Yoshimoto <pythagora.yoshimoto@gmail.com> * fix(multi_object_tracker): bicycle motion model - set minimum wheel-to-center length (autowarefoundation#6337) * fix: bicycle motion model - set minimum wheel-to-center length for stability Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> * chore: align comments Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> --------- Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> --------- Signed-off-by: Mamoru Sobue <mamoru.sobue@tier4.jp> Signed-off-by: Taekjin LEE <taekjin.lee@tier4.jp> Co-authored-by: Mamoru Sobue <mamoru.sobue@tier4.jp> Co-authored-by: Shunsuke Miura <37187849+miursh@users.noreply.github.com> Co-authored-by: Taekjin LEE <technolojin@gmail.com> Co-authored-by: pre-commit-ci[bot] <66853113+pre-commit-ci[bot]@users.noreply.github.com> Co-authored-by: Yoshi Ri <yoshiyoshidetteiu@gmail.com> Co-authored-by: Kotaro Yoshimoto <pythagora.yoshimoto@gmail.com>
2 parents 1535305 + 09bf607 commit 3e02320

File tree

52 files changed

+756
-444
lines changed

Some content is hidden

Large Commits have some content hidden by default. Use the searchbox below for content that may be hidden.

52 files changed

+756
-444
lines changed

perception/crosswalk_traffic_light_estimator/include/crosswalk_traffic_light_estimator/node.hpp

+2-1
Original file line numberDiff line numberDiff line change
@@ -19,7 +19,8 @@
1919
#include <lanelet2_extension/utility/query.hpp>
2020
#include <lanelet2_extension/utility/utilities.hpp>
2121
#include <rclcpp/rclcpp.hpp>
22-
#include <tier4_autoware_utils/tier4_autoware_utils.hpp>
22+
#include <tier4_autoware_utils/ros/debug_publisher.hpp>
23+
#include <tier4_autoware_utils/system/stop_watch.hpp>
2324

2425
#include <autoware_auto_mapping_msgs/msg/had_map_bin.hpp>
2526
#include <autoware_perception_msgs/msg/traffic_signal_array.hpp>

perception/detected_object_validation/include/obstacle_pointcloud_based_validator/debugger.hpp

-1
Original file line numberDiff line numberDiff line change
@@ -16,7 +16,6 @@
1616
#define OBSTACLE_POINTCLOUD_BASED_VALIDATOR__DEBUGGER_HPP_
1717

1818
#include <rclcpp/rclcpp.hpp>
19-
#include <tier4_autoware_utils/tier4_autoware_utils.hpp>
2019

2120
#include <autoware_auto_perception_msgs/msg/detected_objects.hpp>
2221
#include <sensor_msgs/msg/point_cloud2.hpp>

perception/detected_object_validation/src/object_lanelet_filter.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -15,7 +15,7 @@
1515
#include "detected_object_filter/object_lanelet_filter.hpp"
1616

1717
#include <object_recognition_utils/object_recognition_utils.hpp>
18-
#include <tier4_autoware_utils/tier4_autoware_utils.hpp>
18+
#include <tier4_autoware_utils/geometry/geometry.hpp>
1919

2020
#include <boost/geometry/algorithms/convex_hull.hpp>
2121
#include <boost/geometry/algorithms/disjoint.hpp>

perception/detected_object_validation/src/object_position_filter.cpp

-2
Original file line numberDiff line numberDiff line change
@@ -14,8 +14,6 @@
1414

1515
#include "detected_object_filter/object_position_filter.hpp"
1616

17-
#include <tier4_autoware_utils/tier4_autoware_utils.hpp>
18-
1917
namespace object_position_filter
2018
{
2119
ObjectPositionFilterNode::ObjectPositionFilterNode(const rclcpp::NodeOptions & node_options)

perception/detected_object_validation/src/obstacle_pointcloud_based_validator.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -15,7 +15,7 @@
1515
#include "obstacle_pointcloud_based_validator/obstacle_pointcloud_based_validator.hpp"
1616

1717
#include <object_recognition_utils/object_recognition_utils.hpp>
18-
#include <tier4_autoware_utils/tier4_autoware_utils.hpp>
18+
#include <tier4_autoware_utils/geometry/boost_polygon_utils.hpp>
1919

2020
#include <boost/geometry.hpp>
2121

perception/detected_object_validation/src/occupancy_grid_based_validator.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -16,7 +16,7 @@
1616

1717
#include <object_recognition_utils/object_classification.hpp>
1818
#include <object_recognition_utils/object_recognition_utils.hpp>
19-
#include <tier4_autoware_utils/tier4_autoware_utils.hpp>
19+
#include <tier4_autoware_utils/geometry/boost_polygon_utils.hpp>
2020

2121
#include <boost/optional.hpp>
2222

perception/detection_by_tracker/include/detection_by_tracker/debugger.hpp

-1
Original file line numberDiff line numberDiff line change
@@ -20,7 +20,6 @@
2020
#include <euclidean_cluster/voxel_grid_based_euclidean_cluster.hpp>
2121
#include <rclcpp/rclcpp.hpp>
2222
#include <shape_estimation/shape_estimator.hpp>
23-
#include <tier4_autoware_utils/tier4_autoware_utils.hpp>
2423

2524
#include <autoware_auto_perception_msgs/msg/detected_objects.hpp>
2625
#include <autoware_auto_perception_msgs/msg/tracked_objects.hpp>

perception/detection_by_tracker/include/detection_by_tracker/detection_by_tracker_core.hpp

-1
Original file line numberDiff line numberDiff line change
@@ -22,7 +22,6 @@
2222
#include <euclidean_cluster/voxel_grid_based_euclidean_cluster.hpp>
2323
#include <rclcpp/rclcpp.hpp>
2424
#include <shape_estimation/shape_estimator.hpp>
25-
#include <tier4_autoware_utils/tier4_autoware_utils.hpp>
2625

2726
#include <autoware_auto_perception_msgs/msg/detected_objects.hpp>
2827
#include <autoware_auto_perception_msgs/msg/tracked_objects.hpp>

perception/detection_by_tracker/src/detection_by_tracker_core.cpp

+3
Original file line numberDiff line numberDiff line change
@@ -16,6 +16,9 @@
1616

1717
#include "object_recognition_utils/object_recognition_utils.hpp"
1818

19+
#include <tier4_autoware_utils/geometry/geometry.hpp>
20+
#include <tier4_autoware_utils/math/unit_conversion.hpp>
21+
1922
#include <chrono>
2023
#include <memory>
2124
#include <optional>

perception/front_vehicle_velocity_estimator/include/front_vehicle_velocity_estimator/front_vehicle_velocity_estimator.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -19,7 +19,7 @@
1919
#include "pcl/point_types.h"
2020
#include "pcl_conversions/pcl_conversions.h"
2121
#include "rclcpp/logger.hpp"
22-
#include "tier4_autoware_utils/tier4_autoware_utils.hpp"
22+
#include "tier4_autoware_utils/geometry/boost_geometry.hpp"
2323

2424
#include "autoware_auto_perception_msgs/msg/detected_objects.hpp"
2525
#include "nav_msgs/msg/odometry.hpp"

perception/front_vehicle_velocity_estimator/src/front_vehicle_velocity_estimator_node/front_vehicle_velocity_estimator.cpp

+2
Original file line numberDiff line numberDiff line change
@@ -14,6 +14,8 @@
1414

1515
#include "front_vehicle_velocity_estimator/front_vehicle_velocity_estimator.hpp"
1616

17+
#include "tier4_autoware_utils/geometry/geometry.hpp"
18+
1719
#include <boost/geometry.hpp>
1820

1921
#include <memory>

perception/heatmap_visualizer/src/utils.cpp

+2-1
Original file line numberDiff line numberDiff line change
@@ -15,7 +15,8 @@
1515
#include "heatmap_visualizer/utils.hpp"
1616

1717
#include <rclcpp/rclcpp.hpp>
18-
#include <tier4_autoware_utils/tier4_autoware_utils.hpp>
18+
#include <tier4_autoware_utils/math/normalization.hpp>
19+
#include <tier4_autoware_utils/math/unit_conversion.hpp>
1920

2021
#include <tf2/utils.h>
2122

perception/lidar_centerpoint/lib/postprocess/non_maximum_suppression.cpp

+1-2
Original file line numberDiff line numberDiff line change
@@ -16,8 +16,7 @@
1616

1717
#include "object_recognition_utils/geometry.hpp"
1818
#include "object_recognition_utils/object_recognition_utils.hpp"
19-
#include "tier4_autoware_utils/tier4_autoware_utils.hpp"
20-
19+
#include "tier4_autoware_utils/geometry/geometry.hpp"
2120
namespace centerpoint
2221
{
2322

perception/multi_object_tracker/include/multi_object_tracker/tracker/model/bicycle_tracker.hpp

+10-8
Original file line numberDiff line numberDiff line change
@@ -32,16 +32,18 @@ class BicycleTracker : public Tracker
3232
private:
3333
KalmanFilter ekf_;
3434
rclcpp::Time last_update_time_;
35-
enum IDX { X = 0, Y = 1, YAW = 2, VX = 3, SLIP = 4 };
35+
enum IDX { X = 0, Y = 1, YAW = 2, VEL = 3, SLIP = 4 };
3636
struct EkfParams
3737
{
3838
char dim_x = 5;
39-
float q_cov_x;
40-
float q_cov_y;
41-
float q_cov_yaw;
42-
float q_cov_slip;
43-
float q_cov_vx;
44-
float p0_cov_vx;
39+
float q_stddev_acc_long;
40+
float q_stddev_acc_lat;
41+
float q_stddev_yaw_rate_min;
42+
float q_stddev_yaw_rate_max;
43+
float q_cov_slip_rate_min;
44+
float q_cov_slip_rate_max;
45+
float q_max_slip_angle;
46+
float p0_cov_vel;
4547
float p0_cov_slip;
4648
float r_cov_x;
4749
float r_cov_y;
@@ -51,7 +53,7 @@ class BicycleTracker : public Tracker
5153
float p0_cov_yaw;
5254
} ekf_params_;
5355

54-
double max_vx_;
56+
double max_vel_;
5557
double max_slip_;
5658
double lf_;
5759
double lr_;

perception/multi_object_tracker/include/multi_object_tracker/tracker/model/big_vehicle_tracker.hpp

+11-9
Original file line numberDiff line numberDiff line change
@@ -32,26 +32,28 @@ class BigVehicleTracker : public Tracker
3232
private:
3333
KalmanFilter ekf_;
3434
rclcpp::Time last_update_time_;
35-
enum IDX { X = 0, Y = 1, YAW = 2, VX = 3, SLIP = 4 };
35+
enum IDX { X = 0, Y = 1, YAW = 2, VEL = 3, SLIP = 4 };
3636
struct EkfParams
3737
{
3838
char dim_x = 5;
39-
float q_cov_x;
40-
float q_cov_y;
41-
float q_cov_yaw;
42-
float q_cov_slip;
43-
float q_cov_vx;
44-
float p0_cov_vx;
39+
float q_stddev_acc_long;
40+
float q_stddev_acc_lat;
41+
float q_stddev_yaw_rate_min;
42+
float q_stddev_yaw_rate_max;
43+
float q_cov_slip_rate_min;
44+
float q_cov_slip_rate_max;
45+
float q_max_slip_angle;
46+
float p0_cov_vel;
4547
float p0_cov_slip;
4648
float r_cov_x;
4749
float r_cov_y;
4850
float r_cov_yaw;
49-
float r_cov_vx;
51+
float r_cov_vel;
5052
float p0_cov_x;
5153
float p0_cov_y;
5254
float p0_cov_yaw;
5355
} ekf_params_;
54-
double max_vx_;
56+
double max_vel_;
5557
double max_slip_;
5658
double lf_;
5759
double lr_;

perception/multi_object_tracker/include/multi_object_tracker/tracker/model/normal_vehicle_tracker.hpp

+12-9
Original file line numberDiff line numberDiff line change
@@ -33,28 +33,30 @@ class NormalVehicleTracker : public Tracker
3333
private:
3434
KalmanFilter ekf_;
3535
rclcpp::Time last_update_time_;
36-
enum IDX { X = 0, Y = 1, YAW = 2, VX = 3, SLIP = 4 };
36+
enum IDX { X = 0, Y = 1, YAW = 2, VEL = 3, SLIP = 4 };
3737

3838
struct EkfParams
3939
{
4040
char dim_x = 5;
41-
float q_cov_x;
42-
float q_cov_y;
43-
float q_cov_yaw;
44-
float q_cov_slip;
45-
float q_cov_vx;
46-
float p0_cov_vx;
41+
float q_stddev_acc_long;
42+
float q_stddev_acc_lat;
43+
float q_stddev_yaw_rate_min;
44+
float q_stddev_yaw_rate_max;
45+
float q_cov_slip_rate_min;
46+
float q_cov_slip_rate_max;
47+
float q_max_slip_angle;
48+
float p0_cov_vel;
4749
float p0_cov_slip;
4850
float r_cov_x;
4951
float r_cov_y;
5052
float r_cov_yaw;
51-
float r_cov_vx;
53+
float r_cov_vel;
5254
float p0_cov_x;
5355
float p0_cov_y;
5456
float p0_cov_yaw;
5557
} ekf_params_;
5658

57-
double max_vx_;
59+
double max_vel_;
5860
double max_slip_;
5961
double lf_;
6062
double lr_;
@@ -88,6 +90,7 @@ class NormalVehicleTracker : public Tracker
8890
const rclcpp::Time & time,
8991
autoware_auto_perception_msgs::msg::TrackedObject & object) const override;
9092
void setNearestCornerOrSurfaceIndex(const geometry_msgs::msg::Transform & self_transform);
93+
double getMeasurementYaw(const autoware_auto_perception_msgs::msg::DetectedObject & object);
9194
virtual ~NormalVehicleTracker() {}
9295
};
9396

perception/multi_object_tracker/include/multi_object_tracker/utils/utils.hpp

+3-1
Original file line numberDiff line numberDiff line change
@@ -21,14 +21,16 @@
2121

2222
#include <Eigen/Core>
2323
#include <Eigen/Geometry>
24-
#include <tier4_autoware_utils/tier4_autoware_utils.hpp>
2524

2625
#include <autoware_auto_perception_msgs/msg/detected_object.hpp>
2726
#include <autoware_auto_perception_msgs/msg/shape.hpp>
2827
#include <autoware_auto_perception_msgs/msg/tracked_object.hpp>
2928
#include <geometry_msgs/msg/polygon.hpp>
29+
#include <geometry_msgs/msg/transform.hpp>
3030
#include <geometry_msgs/msg/vector3.hpp>
3131

32+
#include <tf2/utils.h>
33+
3234
#include <algorithm>
3335
#include <cmath>
3436
#include <tuple>

perception/multi_object_tracker/models.md

+27-18
Original file line numberDiff line numberDiff line change
@@ -9,21 +9,21 @@ CTRV model is a model that assumes constant turn rate and velocity magnitude.
99
- state transition equation
1010

1111
$$
12-
\begin{align*}
13-
x_{k+1} &= x_k + v_{x_k} \cos(\psi_k) \cdot dt \\
14-
y_{k+1} &= y_k + v_{x_k} \sin(\psi_k) \cdot dt \\
15-
\psi_{k+1} &= \psi_k + \dot{\psi}_k \cdot dt \\
16-
v_{x_{k+1}} &= v_{x_k} \\
17-
\dot{\psi}_{k+1} &= \dot{\psi}_k \\
18-
\end{align*}
12+
\begin{aligned}
13+
x_{k+1} & = x_{k} + v_{k} \cos(\psi_k) \cdot {d t} \\
14+
y_{k+1} & = y_{k} + v_{k} \sin(\psi_k) \cdot {d t} \\
15+
\psi_{k+1} & = \psi_k + \dot\psi_{k} \cdot {d t} \\
16+
v_{k+1} & = v_{k} \\
17+
\dot\psi_{k+1} & = \dot\psi_{k} \\
18+
\end{aligned}
1919
$$
2020

2121
- jacobian
2222

2323
$$
2424
A = \begin{bmatrix}
25-
1 & 0 & -v_x \sin(\psi) \cdot dt & \cos(\psi) \cdot dt & 0 \\
26-
0 & 1 & v_x \cos(\psi) \cdot dt & \sin(\psi) \cdot dt & 0 \\
25+
1 & 0 & -v \sin(\psi) \cdot dt & \cos(\psi) \cdot dt & 0 \\
26+
0 & 1 & v \cos(\psi) \cdot dt & \sin(\psi) \cdot dt & 0 \\
2727
0 & 0 & 1 & 0 & dt \\
2828
0 & 0 & 0 & 1 & 0 \\
2929
0 & 0 & 0 & 0 & 1 \\
@@ -38,17 +38,20 @@ The merit of using this model is that it can prevent unintended yaw rotation whe
3838
![kinematic_bicycle_model](image/kinematic_bicycle_model.png)
3939

4040
- **state variable**
41-
- pose( $x,y$ ), velocity( $v$ ), yaw( $\psi$ ), and slip angle ( $\beta$ )
42-
- $[x_{k} ,y_{k} , v_{k} , \psi_{k} , \beta_{k} ]^\mathrm{T}$
41+
- pose( $x,y$ ), yaw( $\psi$ ), velocity( $v$ ), and slip angle ( $\beta$ )
42+
- $[x_{k}, y_{k}, \psi_{k}, v_{k}, \beta_{k} ]^\mathrm{T}$
4343
- **Prediction Equation**
4444
- $dt$: sampling time
45+
- $w_{k} = \dot\psi_{k} = \frac{ v_{k} \sin \left( \beta_{k} \right) }{ l_r }$ : angular velocity
4546

4647
$$
4748
\begin{aligned}
48-
x_{k+1} & =x_{k}+v_{k} \cos \left(\psi_{k}+\beta_{k}\right) d t \\
49-
y_{k+1} & =y_{k}+v_{k} \sin \left(\psi_{k}+\beta_{k}\right) d t \\
50-
v_{k+1} & =v_{k} \\
51-
\psi_{k+1} & =\psi_{k}+\frac{v_{k}}{l_{r}} \sin \beta_{k} d t \\
49+
x_{k+1} & = x_{k} + v_{k} \cos \left( \psi_{k}+\beta_{k} \right) {d t}
50+
-\frac{1}{2} \left\lbrace w_k v_k \sin \left(\psi_{k}+\beta_{k} \right) \right\rbrace {d t}^2\\
51+
y_{k+1} & = y_{k} + v_{k} \sin \left( \psi_{k}+\beta_{k} \right) {d t}
52+
+\frac{1}{2} \left\lbrace w_k v_k \cos \left(\psi_{k}+\beta_{k} \right) \right\rbrace {d t}^2\\
53+
\psi_{k+1} & =\psi_{k} + w_k {d t} \\
54+
v_{k+1} & = v_{k} \\
5255
\beta_{k+1} & =\beta_{k}
5356
\end{aligned}
5457
$$
@@ -57,9 +60,15 @@ $$
5760

5861
$$
5962
\frac{\partial f}{\partial \mathrm x}=\left[\begin{array}{ccccc}
60-
1 & 0 & -v \sin (\psi+\beta) d t & v \cos (\psi+\beta) & -v \sin (\psi+\beta) d t \\
61-
0 & 1 & v \cos (\psi+\beta) d t & v \sin (\psi+\beta) & v \cos (\psi+\beta) d t \\
62-
0 & 0 & 1 & \frac{1}{l_r} \sin \beta d t & \frac{v}{l_r} \cos \beta d t \\
63+
1 & 0
64+
& v \cos (\psi+\beta) {d t} - \frac{1}{2} \left\lbrace w v \cos \left( \psi+\beta \right) \right\rbrace {d t}^2
65+
& \sin (\psi+\beta) {d t} - \left\lbrace w \sin \left( \psi+\beta \right) \right\rbrace {d t}^2
66+
& -v \sin (\psi+\beta) {d t} - \frac{v^2}{2l_r} \left\lbrace \cos(\beta)\sin(\psi+\beta)+\sin(\beta)\cos(\psi+\beta) \right\rbrace {d t}^2 \\
67+
0 & 1
68+
& v \sin (\psi+\beta) {d t} - \frac{1}{2} \left\lbrace w v \sin \left( \psi+\beta \right) \right\rbrace {d t}^2
69+
& \cos (\psi+\beta) {d t} + \left\lbrace w \cos \left( \psi+\beta \right) \right\rbrace {d t}^2
70+
& v \cos (\psi+\beta) {d t} + \frac{v^2}{2l_r} \left\lbrace \cos(\beta)\cos(\psi+\beta)-\sin(\beta)\sin(\psi+\beta) \right\rbrace {d t}^2 \\
71+
0 & 0 & 1 & \frac{1}{l_r} \sin \beta {d t} & \frac{v}{l_r} \cos \beta d t \\
6372
0 & 0 & 0 & 1 & 0 \\
6473
0 & 0 & 0 & 0 & 1
6574
\end{array}\right]

perception/multi_object_tracker/src/data_association/data_association.cpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -201,7 +201,7 @@ Eigen::MatrixXd DataAssociation::calcScoreMatrix(
201201
measurement_object.kinematics.pose_with_covariance.pose.position,
202202
tracked_object.kinematics.pose_with_covariance.pose.position,
203203
getXYCovariance(tracked_object.kinematics.pose_with_covariance));
204-
if (2.448 /*95%*/ <= mahalanobis_dist) passed_gate = false;
204+
if (3.035 /*99%*/ <= mahalanobis_dist) passed_gate = false;
205205
}
206206
// 2d iou gate
207207
if (passed_gate) {

0 commit comments

Comments
 (0)