tf.hpp
Go to the documentation of this file.
1 #ifndef _ASTRA_ROS_TF_HPP_
2 #define _ASTRA_ROS_TF_HPP_
3 
4 #include <unordered_map>
5 #include <geometry_msgs/TransformStamped.h>
6 #include <astra_ros/Body.h>
7 
8 namespace astra_ros
9 {
10  std::vector<geometry_msgs::TransformStamped> bodyTransforms(const Body &body);
11 }
12 
13 #endif
astra_ros::bodyTransforms
std::vector< geometry_msgs::TransformStamped > bodyTransforms(const Body &body)
Definition: tf.cpp:90
astra_ros
Definition: Device.hpp:14


astra_ros
Author(s): Braden McDorman
autogenerated on Wed Mar 2 2022 00:53:06