From f19b8e570c2631a6f75b25e9a8e5b007cdc6000d Mon Sep 17 00:00:00 2001 From: Roman Bapst Date: Mon, 15 Dec 2014 09:06:58 +0100 Subject: added file to make PX4 math functions compatible with eigen --- src/platforms/ros/eigen_math.h | 20 ++++++++++++++++++++ 1 file changed, 20 insertions(+) create mode 100755 src/platforms/ros/eigen_math.h (limited to 'src/platforms/ros/eigen_math.h') diff --git a/src/platforms/ros/eigen_math.h b/src/platforms/ros/eigen_math.h new file mode 100755 index 000000000..60fc9b93c --- /dev/null +++ b/src/platforms/ros/eigen_math.h @@ -0,0 +1,20 @@ +/* + * eigen_math.h + * + * Created on: Aug 25, 2014 + * Author: roman + */ + +#ifndef EIGEN_MATH_H_ +#define EIGEN_MATH_H_ + + +struct eigen_matrix_instance +{ + int numRows; + int numCols; + float *pData; +}; + + +#endif /* EIGEN_MATH_H_ */ -- cgit v1.2.3