Go to the documentation of this file.00001
00002
00003
00004
00005
00006
00007
00008
00009
00010
00011
00012
00013
00014
00015
00016
00017 #ifndef CARTOGRAPHER_ROS_CARTOGRAPHER_ROS_URDF_READER_H
00018 #define CARTOGRAPHER_ROS_CARTOGRAPHER_ROS_URDF_READER_H
00019
00020 #include <vector>
00021
00022 #include "cartographer/common/port.h"
00023 #include "tf2_ros/buffer.h"
00024
00025 namespace cartographer_ros {
00026
00027 std::vector<geometry_msgs::TransformStamped> ReadStaticTransformsFromUrdf(
00028 const std::string& urdf_filename, tf2_ros::Buffer* tf_buffer);
00029
00030 }
00031
00032 #endif // CARTOGRAPHER_ROS_CARTOGRAPHER_ROS_URDF_READER_H