17#include <tf2_geometry_msgs/tf2_geometry_msgs.hpp>
29 rclcpp::node_interfaces::NodeLoggingInterface::SharedPtr logger,
30 std::unique_ptr<carma_ros2_utils::timers::TimerFactory> timer_factory)
31 : pose_pub_(pose_pub), state_pub_(state_pub), initialpose_pub_(initialpose_pub), config_(config), logger_(logger), timer_factory_(std::move(timer_factory)), transition_table_(static_cast<
LocalizerMode>(config_.localization_mode))
36 std::placeholders::_1, std::placeholders::_2,
37 std::placeholders::_3));
43 return 1.0 / (new_stamp - old_stamp).seconds();
62 RCLCPP_ERROR_STREAM(rclcpp::get_logger(
"localization_manager"),
"LocalizationManager received NDT data out of order. Prev stamp was "
63 <<
prev_ndt_stamp_.get().seconds() <<
" new stamp is " << new_stamp.seconds());
71 const autoware_msgs::msg::NDTStat::ConstPtr stats)
74 RCLCPP_DEBUG_STREAM(rclcpp::get_logger(
"localization_manager"),
"Received pose resulting in frequency value of " << ndt_freq <<
" with score of " << stats->score);
110 RCLCPP_DEBUG_STREAM(rclcpp::get_logger(
"localization_manager"),
"Switched to LIDAR_INITIALIZED_SWITCH_TO_GPS at lidar_init_sequential_timesteps_counter_: " <<
lidar_init_sequential_timesteps_counter_
127 tf2::Vector3 ndt_translation(pose->pose.position.x, pose->pose.position.y, pose->pose.position.z);
136 RCLCPP_DEBUG_STREAM(rclcpp::get_logger(
"localization_manager"),
"Publishing mixed pose with lidar_init_sequential_timesteps_counter_: " <<
lidar_init_sequential_timesteps_counter_ <<
", and state" << state);
152 geometry_msgs::msg::PoseWithCovarianceStamped new_initial_pose;
153 new_initial_pose.header = msg->header;
154 new_initial_pose.pose.pose = msg->pose;
161 geometry_msgs::msg::PoseStamped corrected_pose = *msg;
164 corrected_pose.pose.position.x = corrected_pose.pose.position.x +
gnss_offset_->x();
165 corrected_pose.pose.position.y = corrected_pose.pose.position.y +
gnss_offset_->y();
166 corrected_pose.pose.position.z = corrected_pose.pose.position.z +
gnss_offset_->z();
208 std::lock_guard<std::mutex> guard(
mutex_);
215 if (it->second.second)
230 RCLCPP_INFO_STREAM(rclcpp::get_logger(
"localization_manager"),
"State transition from " << prev_state <<
" to " << new_state <<
" with signal " << signal);
void poseAndStatsCallback(const geometry_msgs::msg::PoseStamped::ConstPtr pose, const autoware_msgs::msg::NDTStat::ConstPtr stats)
Synced callback for the NDT reported pose and status messages.
int lidar_init_sequential_timesteps_counter_
void posePubTick()
Timer callback that controls the publication of the selected pose and status report.
void timerCallback(const LocalizationState origin_state)
Callback for timeouts. Used to trigger timeout signals for the state machine.
uint32_t current_timer_id_
void gnssPoseCallback(const geometry_msgs::msg::PoseStamped::SharedPtr msg)
Callback for new GNSS messages.
uint32_t nextId()
Generates the next id to be used for a timer.
void stateTransitionCallback(LocalizationState prev_state, LocalizationState new_state, LocalizationSignal signal)
Callback for when a new state was triggered. Allows creation of entry/exit behavior for states.
void initialPoseCallback(const geometry_msgs::msg::PoseWithCovarianceStamped::SharedPtr msg)
Callback for the initial pose provided by Rviz or some external localization initializer.
boost::optional< geometry_msgs::msg::PoseStamped > last_raw_gnss_value_
LocalizationManagerConfig config_
std::unique_ptr< carma_ros2_utils::timers::TimerFactory > timer_factory_
double computeFreq(const rclcpp::Time &old_stamp, const rclcpp::Time &new_stamp) const
Helper function to compute the instantaneous frequency between two times.
std::function< void(const carma_localization_msgs::msg::LocalizationStatusReport &)> StatePublisher
void clearTimers()
Clears the expired timers from the memory of this scheduler.
static const std::unordered_set< std::string > LIDAR_FAILURE_STRINGS
The set of strings which mark a lidar failure in a system alert message.
LocalizationTransitionTable transition_table_
StatePublisher state_pub_
rcl_clock_type_t timer_clock_type_
void systemAlertCallback(const carma_msgs::msg::SystemAlert::SharedPtr alert)
Callback for SystemAlert data. Used to check for lidar failure.
boost::optional< tf2::Vector3 > gnss_offset_
LocalizationState getState() const
Returns the current localization state.
boost::optional< rclcpp::Time > prev_ndt_stamp_
boost::optional< geometry_msgs::msg::PoseStamped > current_pose_
std::function< void(const geometry_msgs::msg::PoseStamped &)> PosePublisher
LocalizationManager(PosePublisher pose_pub, StatePublisher state_pub, ManagedInitialPosePublisher initialpose_pub, const LocalizationManagerConfig &config, rclcpp::node_interfaces::NodeLoggingInterface::SharedPtr logger, std::unique_ptr< carma_ros2_utils::timers::TimerFactory > timer_factory)
Constructor.
double computeNDTFreq(const rclcpp::Time &new_stamp)
Helper function to both compute the NDT Frequency and update the previous pose timestamp.
void setConfig(const LocalizationManagerConfig &config)
Set config.
TimerUniquePtr current_timer_
ManagedInitialPosePublisher initialpose_pub_
std::unordered_map< uint32_t, std::pair< TimerUniquePtr, bool > > timers_
std::function< void(const geometry_msgs::msg::PoseWithCovarianceStamped &)> ManagedInitialPosePublisher
void signal(LocalizationSignal signal)
Trigger signal for the transition table.
LocalizationState getState() const
Returns the current state.
void setTransitionCallback(TransitionCallback cb)
Callback setting function. The provided callback will be triggered any time the current state changes...
carma_localization_msgs::msg::LocalizationStatusReport stateToMsg(LocalizationState state, const rclcpp::Time &stamp)
Helper function to convert LocalizationState objects into LocalizationStatusReport ROS messages.
LocalizationState
Enum describing the possible states of the localization system.
LocalizerMode
Enum describing the possible operational modes of the LocalizationManager.
LocalizationSignal
Enum describing the possible signals to change the current LocalizationState.
@ POOR_NDT_FREQ_OR_FITNESS_SCORE
@ UNUSABLE_NDT_FREQ_OR_FITNESS_SCORE
@ GOOD_NDT_FREQ_AND_FITNESS_SCORE
@ LIDAR_INITIALIZED_SWITCH_TO_GPS
Struct to store the configuration settings for the LocalizationManager class.
int gnss_only_operation_timeout
Timeout in ms for GNSS only operation. Ignored when in GNSS mode.
double fitness_score_fault_threshold
double fitness_score_degraded_threshold
NDT Fitness score above which the localization is considered in a degraded state.
int localization_mode
Localization mode to use.
int auto_initialization_timeout
double x_offset
GPS Offset to apply if that mode is enabled.
int gnss_data_timeout
GNSS Data timeout. If exceeded the system will assume the GNSS is no longer functional....
double ndt_frequency_fault_threshold
double ndt_frequency_degraded_threshold
NDT solution frequency below which the localization is considered in a degraded state.
int sequential_timesteps_until_gps_operation