Class SynchronousSlamToolbox

Inheritance Relationships

Base Type

Class Documentation

class SynchronousSlamToolbox : public slam_toolbox::SlamToolbox

Public Functions

explicit SynchronousSlamToolbox(rclcpp::NodeOptions options)
inline ~SynchronousSlamToolbox()
void run()

Protected Functions

virtual void laserCallback(sensor_msgs::msg::LaserScan::ConstSharedPtr scan) override
bool clearQueueCallback(const std::shared_ptr<rmw_request_id_t> request_header, const std::shared_ptr<slam_toolbox::srv::ClearQueue::Request> req, std::shared_ptr<slam_toolbox::srv::ClearQueue::Response> resp)
virtual bool deserializePoseGraphCallback(const std::shared_ptr<rmw_request_id_t> request_header, const std::shared_ptr<slam_toolbox::srv::DeserializePoseGraph::Request> req, std::shared_ptr<slam_toolbox::srv::DeserializePoseGraph::Response> resp) override

Protected Attributes

std::queue<PosedScan> q_
std::shared_ptr<rclcpp::Service<slam_toolbox::srv::ClearQueue>> ssClear_
boost::mutex q_mutex_