Main Page
Namespaces
Classes
Files
File List
File Members
include
robot_model_services
robot_model
impl
MILDRobotModelWithApproximatedIK.hpp
Go to the documentation of this file.
1
20
#pragma once
21
22
#include <boost/tuple/tuple.hpp>
23
#include "
robot_model_services/robot_model/impl/MILDRobotModel.hpp
"
24
#include "
robot_model_services/typedef.hpp
"
25
#include "geometry_msgs/Pose.h"
26
#include <
ros/ros.h
>
27
#include <
tf/transform_listener.h
>
28
#include "
robot_model_services/helper/DebugHelper.hpp
"
29
30
namespace
robot_model_services
{
38
class
MILDRobotModelWithApproximatedIK
:
public
MILDRobotModel
{
39
public
:
43
MILDRobotModelWithApproximatedIK
();
44
48
virtual
~MILDRobotModelWithApproximatedIK
();
49
50
51
RobotStatePtr
calculateRobotState
(
const
RobotStatePtr
&sourceRobotState,
const
SimpleVector3
&position,
const
SimpleQuaternion
&orientation);
52
53
};
54
55
typedef
boost::shared_ptr<MILDRobotModelWithApproximatedIK>
MILDRobotModelWithApproximatedIKPtr
;
56
}
transform_listener.h
robot_model_services::MILDRobotModel
MILDRobotModel implements a model of pan tilt unit robot.
Definition:
MILDRobotModel.hpp:39
DebugHelper.hpp
robot_model_services::MILDRobotModelWithApproximatedIKPtr
boost::shared_ptr< MILDRobotModelWithApproximatedIK > MILDRobotModelWithApproximatedIKPtr
Definition:
MILDRobotModelWithApproximatedIK.hpp:55
robot_model_services::SimpleVector3
Eigen::Matrix< Precision, 3, 1 > SimpleVector3
Definition:
typedef.hpp:50
robot_model_services::MILDRobotModelWithApproximatedIK
MILDRobotModelWithApproximatedIK implements a model of pan tilt unit robot where the inverse kinemati...
Definition:
MILDRobotModelWithApproximatedIK.hpp:38
boost::shared_ptr< RobotState >
robot_model_services::MILDRobotModelWithApproximatedIK::MILDRobotModelWithApproximatedIK
MILDRobotModelWithApproximatedIK()
constructor of the MILDRobotModelWithApproximatedIK
Definition:
MILDRobotModelWithApproximatedIK.cpp:45
robot_model_services::MILDRobotModelWithApproximatedIK::calculateRobotState
RobotStatePtr calculateRobotState(const RobotStatePtr &sourceRobotState, const SimpleVector3 &position, const SimpleQuaternion &orientation)
calculates the target robot state
Definition:
MILDRobotModelWithApproximatedIK.cpp:67
typedef.hpp
robot_model_services
this namespace contains all generally usable classes.
Definition:
DebugHelper.hpp:27
ros.h
MILDRobotModel.hpp
robot_model_services::MILDRobotModelWithApproximatedIK::~MILDRobotModelWithApproximatedIK
virtual ~MILDRobotModelWithApproximatedIK()
destructor of the MILDRobotModelWithApproximatedIK
Definition:
MILDRobotModelWithApproximatedIK.cpp:62
robot_model_services::SimpleQuaternion
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