Swarm-SLAM
1.0.0
C-SLAM Framework
|
#include <logger.h>
Public Member Functions | |
Logger (std::shared_ptr< rclcpp::Node > &node, const unsigned int &robot_id, const unsigned int &max_nb_robots, const std::string &log_folder) | |
Logger class to log various metrics. More... | |
void | add_pose_graph_log_info (const cslam_common_interfaces::msg::PoseGraph &msg) |
void | log_initial_global_pose_graph (const gtsam::NonlinearFactorGraph::shared_ptr &graph, const gtsam::Values::shared_ptr &initial) |
void | log_optimized_global_pose_graph (const gtsam::NonlinearFactorGraph::shared_ptr &graph, const gtsam::Values &result, const unsigned int &origin_robot_id) |
void | start_timer () |
void | stop_timer () |
void | write_logs () |
void | log_callback (const diagnostic_msgs::msg::KeyValue::ConstSharedPtr msg) |
Receive log messages. More... | |
void | log_matches_callback (const cslam_common_interfaces::msg::InterRobotMatches::ConstSharedPtr msg) |
Receive log messages. More... | |
void | fill_msg (cslam_common_interfaces::msg::PoseGraph &msg) |
void | log_pose_timestamp (const gtsam::LabeledSymbol &symbol, const int &sec, const int &nanosec) |
cslam::Logger::Logger | ( | std::shared_ptr< rclcpp::Node > & | node, |
const unsigned int & | robot_id, | ||
const unsigned int & | max_nb_robots, | ||
const std::string & | log_folder | ||
) |
Logger class to log various metrics.
Definition at line 6 of file logger.cpp.
void cslam::Logger::add_pose_graph_log_info | ( | const cslam_common_interfaces::msg::PoseGraph & | msg | ) |
Definition at line 39 of file logger.cpp.
void cslam::Logger::fill_msg | ( | cslam_common_interfaces::msg::PoseGraph & | msg | ) |
Definition at line 325 of file logger.cpp.
void cslam::Logger::log_callback | ( | const diagnostic_msgs::msg::KeyValue::ConstSharedPtr | msg | ) |
Receive log messages.
msg |
Definition at line 274 of file logger.cpp.
void cslam::Logger::log_initial_global_pose_graph | ( | const gtsam::NonlinearFactorGraph::shared_ptr & | graph, |
const gtsam::Values::shared_ptr & | initial | ||
) |
Definition at line 44 of file logger.cpp.
void cslam::Logger::log_matches_callback | ( | const cslam_common_interfaces::msg::InterRobotMatches::ConstSharedPtr | msg | ) |
Receive log messages.
msg |
Definition at line 310 of file logger.cpp.
void cslam::Logger::log_optimized_global_pose_graph | ( | const gtsam::NonlinearFactorGraph::shared_ptr & | graph, |
const gtsam::Values & | result, | ||
const unsigned int & | origin_robot_id | ||
) |
Definition at line 50 of file logger.cpp.
void cslam::Logger::log_pose_timestamp | ( | const gtsam::LabeledSymbol & | symbol, |
const int & | sec, | ||
const int & | nanosec | ||
) |
Definition at line 34 of file logger.cpp.
void cslam::Logger::start_timer | ( | ) |
Definition at line 59 of file logger.cpp.
void cslam::Logger::stop_timer | ( | ) |
Definition at line 64 of file logger.cpp.
void cslam::Logger::write_logs | ( | ) |
Definition at line 71 of file logger.cpp.