Autoware.Auto
state_estimation_node.cpp File Reference
#include <state_estimation_nodes/state_estimation_node.hpp>
#include <measurement_conversion/measurement_conversion.hpp>
#include <motion_model/linear_motion_model.hpp>
#include <rclcpp_components/register_node_macro.hpp>
#include <state_estimation/kalman_filter/kalman_filter.hpp>
#include <state_estimation/noise_model/wiener_noise.hpp>
#include <tf2_eigen/tf2_eigen.h>
#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
#include <functional>
#include <limits>
#include <memory>
#include <string>
#include <vector>
Include dependency graph for state_estimation_node.cpp:

Namespaces

 autoware
 This file defines the lanelet2_map_provider_node class.
 
 autoware::common
 
 autoware::common::state_estimation
 

Functions

template void autoware::common::state_estimation::StateEstimationNode::create_subscriptions< StateEstimationNode::PoseMsgT > (const std::vector< std::string > &, std::vector< rclcpp::Subscription< PoseMsgT >::SharedPtr > *, CallbackFnT< StateEstimationNode::PoseMsgT >)
 
template void autoware::common::state_estimation::StateEstimationNode::create_subscriptions< StateEstimationNode::RelativePosMsgT > (const std::vector< std::string > &, std::vector< rclcpp::Subscription< RelativePosMsgT >::SharedPtr > *, CallbackFnT< StateEstimationNode::RelativePosMsgT >)