aboutsummaryrefslogblamecommitdiff
path: root/src/platforms/ros/eigen_math.h
blob: c7271c1575b297ae39c45f4d42b2235b0470d2af (plain) (tree)
1
2
3
4
5
6
7
8
9
10
11










                            
                              






                          
/*
 * 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_ */