RKO-LIO
Lidar-inertial odometry
Navigation
Contents:
Primer
Quickstart
Data
ROS
Setup
Usage
C++ API
ROS package.xml
Changelog
Python
Configuring rko_lio
Uncategorised
License
ROS Index
PyPI
GitHub
Template Function rko_lio::ros::utils::get_transform
¶
Defined in
File transforms.hpp
Function Documentation
¶
template
<
typename
Scalar
=
double
>
std
::
optional
<
Sophus
::
SE3
<
Scalar
>
>
rko_lio
::
ros
::
utils
::
get_transform
(
const
std
::
shared_ptr
<
tf2_ros
::
Buffer
>
&
tf_buffer
,
const
std
::
string
&
from_frame
,
const
std
::
string
&
to_frame
,
const
std
::
chrono
::
duration
<
double
>
&
time
,
const
std
::
chrono
::
duration
<
double
>
&
timeout
=
std
::
chrono
::
duration
<
double
>
(
0
)
)
¶
←
Function rko_lio::ros::utils::eigen_vector3d_to_ros_xyz
Function rko_lio::ros::utils::point_cloud2_to_eigen
→