MILDRobotModelWithApproximatedIK.hpp
Go to the documentation of this file.
1 
20 #pragma once
21 
22 #include <boost/tuple/tuple.hpp>
25 #include "geometry_msgs/Pose.h"
26 #include <ros/ros.h>
27 #include <tf/transform_listener.h>
29 
30 namespace robot_model_services {
39  public:
44 
49 
50 
51  RobotStatePtr calculateRobotState(const RobotStatePtr &sourceRobotState, const SimpleVector3 &position, const SimpleQuaternion &orientation);
52 
53  };
54 
56 }
MILDRobotModel implements a model of pan tilt unit robot.
boost::shared_ptr< MILDRobotModelWithApproximatedIK > MILDRobotModelWithApproximatedIKPtr
Eigen::Matrix< Precision, 3, 1 > SimpleVector3
Definition: typedef.hpp:50
MILDRobotModelWithApproximatedIK implements a model of pan tilt unit robot where the inverse kinemati...
MILDRobotModelWithApproximatedIK()
constructor of the MILDRobotModelWithApproximatedIK
RobotStatePtr calculateRobotState(const RobotStatePtr &sourceRobotState, const SimpleVector3 &position, const SimpleQuaternion &orientation)
calculates the target robot state
this namespace contains all generally usable classes.
Definition: DebugHelper.hpp:27
virtual ~MILDRobotModelWithApproximatedIK()
destructor of the MILDRobotModelWithApproximatedIK
Eigen::Quaternion< Precision > SimpleQuaternion
Definition: typedef.hpp:64


asr_robot_model_services
Author(s): Aumann Florian, Borella Jocelyn, Heller Florian, Meißner Pascal, Schleicher Ralf, Stöckle Patrick, Stroh Daniel, Trautmann Jeremias, Walter Milena, Wittenbeck Valerij
autogenerated on Mon Jun 10 2019 12:49:59