Autoware.Auto
|
|
#include <state_estimation_nodes/kalman_filter_wrapper.hpp>
#include <common/types.hpp>
#include <measurement_conversion/eigen_utils.hpp>
#include <nav_msgs/msg/odometry.hpp>
#include <rclcpp/time.hpp>
#include <tf2/LinearMath/Quaternion.h>
#include <tf2_eigen/tf2_eigen.h>
#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
#include <Eigen/Core>
#include <Eigen/Geometry>
#include <algorithm>
#include <cstdint>
#include <limits>
Namespaces | |
autoware | |
This file defines the lanelet2_map_provider_node class. | |
autoware::common | |
autoware::common::state_estimation | |
Variables | |
template class STATE_ESTIMATION_NODES_PUBLIC | autoware::common::state_estimation::KalmanFilterWrapper< ConstAccelerationKalmanFilterXY > |
template class STATE_ESTIMATION_NODES_PUBLIC | autoware::common::state_estimation::KalmanFilterWrapper< ConstAccelerationKalmanFilterXYZRPY > |