Main Page
Modules
Namespaces
Namespace List
Namespace Members
All
a
b
c
d
e
f
g
i
k
l
m
n
o
p
r
s
t
v
w
Functions
a
c
d
f
g
i
l
m
n
o
p
r
s
t
w
Variables
Typedefs
Enumerations
Enumerator
Classes
Class List
Class Hierarchy
Class Members
All
a
b
c
d
e
f
g
h
i
k
l
m
n
o
p
q
r
s
t
u
v
w
y
~
Functions
a
b
c
d
e
f
g
h
i
k
l
m
n
o
p
q
r
s
t
u
v
w
~
Variables
a
b
c
d
e
f
g
h
i
l
m
n
o
p
q
r
s
t
u
v
w
y
Typedefs
b
c
d
e
i
l
m
n
s
v
Related Functions
b
c
e
i
m
o
s
Files
File List
File Members
All
a
b
c
d
e
f
g
k
m
n
o
r
s
Functions
b
g
m
n
r
Variables
Typedefs
Macros
include
slam_toolbox
slam_toolbox_async.hpp
Go to the documentation of this file.
1
/*
2
* slam_toolbox
3
* Copyright Work Modifications (c) 2018, Simbe Robotics, Inc.
4
* Copyright Work Modifications (c) 2019, Steve Macenski
5
*
6
* THE WORK (AS DEFINED BELOW) IS PROVIDED UNDER THE TERMS OF THIS CREATIVE
7
* COMMONS PUBLIC LICENSE ("CCPL" OR "LICENSE"). THE WORK IS PROTECTED BY
8
* COPYRIGHT AND/OR OTHER APPLICABLE LAW. ANY USE OF THE WORK OTHER THAN AS
9
* AUTHORIZED UNDER THIS LICENSE OR COPYRIGHT LAW IS PROHIBITED.
10
*
11
* BY EXERCISING ANY RIGHTS TO THE WORK PROVIDED HERE, YOU ACCEPT AND AGREE TO
12
* BE BOUND BY THE TERMS OF THIS LICENSE. THE LICENSOR GRANTS YOU THE RIGHTS
13
* CONTAINED HERE IN CONSIDERATION OF YOUR ACCEPTANCE OF SUCH TERMS AND
14
* CONDITIONS.
15
*
16
*/
17
18
/* Author: Steven Macenski */
19
20
#ifndef SLAM_TOOLBOX_SLAM_TOOLBOX_ASYNC_H_
21
#define SLAM_TOOLBOX_SLAM_TOOLBOX_ASYNC_H_
22
23
#include "
slam_toolbox/slam_toolbox_common.hpp
"
24
25
namespace
slam_toolbox
26
{
27
28
class
AsynchronousSlamToolbox
:
public
SlamToolbox
29
{
30
public
:
31
AsynchronousSlamToolbox
(
ros::NodeHandle
& nh);
32
~AsynchronousSlamToolbox
() {};
33
34
protected
:
35
virtual
void
laserCallback
(
36
const
sensor_msgs::LaserScan::ConstPtr& scan)
override
final
;
37
virtual
bool
deserializePoseGraphCallback
(
38
slam_toolbox_msgs::DeserializePoseGraph::Request& req,
39
slam_toolbox_msgs::DeserializePoseGraph::Response& resp)
override
final
;
40
};
41
42
}
43
44
#endif //SLAM_TOOLBOX_SLAM_TOOLBOX_ASYNC_H_
slam_toolbox::SlamToolbox
Definition:
slam_toolbox_common.hpp:55
slam_toolbox::AsynchronousSlamToolbox
Definition:
slam_toolbox_async.hpp:28
slam_toolbox_common.hpp
slam_toolbox::AsynchronousSlamToolbox::laserCallback
virtual void laserCallback(const sensor_msgs::LaserScan::ConstPtr &scan) override final
Definition:
slam_toolbox_async.cpp:34
slam_toolbox::AsynchronousSlamToolbox::~AsynchronousSlamToolbox
~AsynchronousSlamToolbox()
Definition:
slam_toolbox_async.hpp:32
slam_toolbox::AsynchronousSlamToolbox::deserializePoseGraphCallback
virtual bool deserializePoseGraphCallback(slam_toolbox_msgs::DeserializePoseGraph::Request &req, slam_toolbox_msgs::DeserializePoseGraph::Response &resp) override final
Definition:
slam_toolbox_async.cpp:65
slam_toolbox
Definition:
slam_toolbox_lifelong.hpp:24
ros::NodeHandle
slam_toolbox::AsynchronousSlamToolbox::AsynchronousSlamToolbox
AsynchronousSlamToolbox(ros::NodeHandle &nh)
Definition:
slam_toolbox_async.cpp:26
slam_toolbox
Author(s): Steve Macenski
autogenerated on Thu Jan 23 2025 03:37:19