Classes | Typedefs | Functions
robot_model_services Namespace Reference

this namespace contains all generally usable classes. More...

Classes

class  AngleApproximationIKRatingModule
 AngleApproximationIKRatingModule uses an approximation of the total angle delta during the mild movement for the rating. More...
class  DebugHelper
 The DebugHelper class is responsible for debug output. More...
class  IKRatingModule
 IKRatingModule is a generalization for the rating of the inverse kinematic parameters. More...
class  MapHelper
class  MathHelper
 MathHelper unites the generally needed math operations. More...
class  MILDRobotModel
 MILDRobotModel implements a model of pan tilt unit robot. More...
class  MILDRobotModelWithApproximatedIK
 MILDRobotModelWithApproximatedIK implements a model of pan tilt unit robot where the inverse kinematic is defined by an approximation function. More...
class  MILDRobotModelWithApproximatedIKFactory
class  MILDRobotModelWithExactIK
class  MILDRobotModelWithExactIKFactory
struct  MILDRobotState
class  NavigationPathIKRatingModule
 NavigationPathIKRatingModule implements the functionlities offered by IKRatingModule. More...
struct  RayTracingIndex
class  RobotModel
 RobotModel generalizes a robot model. More...
class  RobotModelAbstractFactory
struct  RobotState
class  SimpleIKRatingModule
 SimpleIKRatingModule uses the difference between the start and target angle for the rating. More...
class  TypeHelper

Typedefs

typedef boost::shared_ptr
< AngleApproximationIKRatingModule
AngleApproximationIKRatingModulePtr
 Definition for the shared pointer type of the class.
typedef boost::shared_ptr
< DebugHelper
DebugHelperPtr
typedef Eigen::Matrix< int, 3, 1 > GridVector3
typedef boost::shared_ptr
< IKRatingModule
IKRatingModulePtr
 Definition for the shared pointer type of the class.
typedef std::vector< int > Indices
typedef boost::shared_ptr
< const IndicesPtr
IndicesConstPtr
typedef boost::shared_ptr
< Indices
IndicesPtr
typedef boost::shared_ptr
< MapHelper
MapHelperPtr
typedef boost::shared_ptr
< MILDRobotModel
MILDRobotModelPtr
typedef boost::shared_ptr
< MILDRobotModelWithApproximatedIKFactory
MILDRobotModelWithApproximatedIKFactoryPtr
typedef boost::shared_ptr
< MILDRobotModelWithApproximatedIK
MILDRobotModelWithApproximatedIKPtr
typedef boost::shared_ptr
< MILDRobotModelWithExactIKFactory
MILDRobotModelWithExactIKFactoryPtr
typedef boost::shared_ptr
< MILDRobotModelWithExactIK
MILDRobotModelWithExactIKPtr
typedef boost::shared_ptr
< MILDRobotState
MILDRobotStatePtr
typedef boost::shared_ptr
< NavigationPathIKRatingModule
NavigationPathIKRatingModulePtr
 Definition for the shared pointer type of the class.
typedef RealObjectPoint ObjectPoint
typedef std::vector< std::string > ObjectTypeList
typedef boost::shared_ptr
< ObjectTypeList
ObjectTypeListPtr
typedef std::set
< ObjectTypeSetPtr
ObjectTypePowerSet
typedef boost::shared_ptr
< ObjectTypePowerSet
ObjectTypePowerSetPtr
typedef std::set< std::string > ObjectTypeSet
typedef boost::shared_ptr
< ObjectTypeSet
ObjectTypeSetPtr
typedef float Precision
typedef std::tuple< double,
double > 
PTUConfig
 MILDRobotModelWithExactIK implements a model of pan tilt unit robot where the inverse kinematic is calculated exactly.
typedef std::vector
< RayTracingIndex
Ray
typedef boost::shared_ptr
< RayTracingIndex
RayTracingIndexPtr
typedef boost::shared_ptr
< RobotModelAbstractFactory
RobotModelAbstractFactoryPtr
typedef boost::shared_ptr
< RobotModel
RobotModelPtr
 Definition for the shared pointer type of the class.
typedef boost::shared_ptr
< RobotState
RobotStatePtr
typedef SpaceSamplePoint SamplePoint
typedef boost::shared_ptr
< SimpleIKRatingModule
SimpleIKRatingModulePtr
 Definition for the shared pointer type of the class.
typedef Eigen::Matrix
< Precision, 2, 2 > 
SimpleMatrix2
typedef Eigen::Matrix
< Precision, 3, 3 > 
SimpleMatrix3
typedef std::vector
< SimpleMatrix3,
Eigen::aligned_allocator
< SimpleMatrix3 > > 
SimpleMatrix3Collection
typedef boost::shared_ptr
< SimpleMatrix3Collection
SimpleMatrix3CollectionPtr
typedef Eigen::Matrix
< Precision, 4, 4 > 
SimpleMatrix4
typedef std::vector
< SimpleMatrix4,
Eigen::aligned_allocator
< SimpleMatrix4 > > 
SimpleMatrix4Collection
typedef boost::shared_ptr
< SimpleMatrix4Collection
SimpleMatrix4CollectionPtr
typedef Eigen::Matrix
< Precision, Eigen::Dynamic,
Eigen::Dynamic > 
SimpleMatrixX
typedef Eigen::Quaternion
< Precision
SimpleQuaternion
typedef std::vector
< SimpleQuaternion,
Eigen::aligned_allocator
< SimpleQuaternion > > 
SimpleQuaternionCollection
typedef boost::shared_ptr
< SimpleQuaternionCollection
SimpleQuaternionCollectionPtr
typedef SimpleVector3 SimpleSphereCoordinates
typedef Eigen::Matrix
< Precision, 2, 1 > 
SimpleVector2
typedef Eigen::Matrix
< Precision, 3, 1 > 
SimpleVector3
typedef std::vector
< SimpleVector3,
Eigen::aligned_allocator
< SimpleVector3 > > 
SimpleVector3Collection
typedef boost::shared_ptr
< SimpleVector3Collection
SimpleVector3CollectionPtr
typedef Eigen::Matrix
< Precision, 4, 1 > 
SimpleVector4
typedef std::vector
< SimpleVector4,
Eigen::aligned_allocator
< SimpleVector4 > > 
SimpleVector4Collection
typedef boost::shared_ptr
< SimpleVector4Collection
SimpleVector4CollectionPtr
typedef Eigen::Matrix
< Precision, Eigen::Dynamic, 1 > 
SimpleVectorX
typedef std::vector< float > SquaredDistances
typedef DefaultViewportPoint ViewportPoint
typedef voxel_grid::VoxelGrid VoxelGrid
typedef boost::shared_ptr
< VoxelGrid
VoxelGridPtr

Functions

std::ostream & operator<< (std::ostream &strm, const robot_model_services::MILDRobotState &r)
std::ostream & operator<< (std::ostream &strm, const robot_model_services::MILDRobotStatePtr &r)

Detailed Description

this namespace contains all generally usable classes.

Copyright (c) 2016, Aumann Florian, Borella Jocelyn, Heller Florian, Meißner Pascal, Schleicher Ralf, Stöckle Patrick, Stroh Daniel, Trautmann Jeremias, Walter Milena, Wittenbeck Valerij All rights reserved.

Redistribution and use in source and binary forms, with or without modification, are permitted provided that the following conditions are met:

1. Redistributions of source code must retain the above copyright notice, this list of conditions and the following disclaimer.

2. Redistributions in binary form must reproduce the above copyright notice, this list of conditions and the following disclaimer in the documentation and/or other materials provided with the distribution.

3. Neither the name of the copyright holder nor the names of its contributors may be used to endorse or promote products derived from this software without specific prior written permission.

4. The use is explicitly not permitted to any application which deliberately try to kill or do harm to any living creature.

THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.


Typedef Documentation

Definition for the shared pointer type of the class.

Definition at line 62 of file AngleApproximationIKRatingModule.h.

Definition at line 152 of file DebugHelper.hpp.

typedef Eigen::Matrix<int, 3, 1> robot_model_services::GridVector3

Definition at line 54 of file typedef.hpp.

Definition for the shared pointer type of the class.

Definition at line 60 of file IKRatingModule.h.

typedef std::vector<int> robot_model_services::Indices

Definition at line 84 of file typedef.hpp.

typedef boost::shared_ptr<const IndicesPtr> robot_model_services::IndicesConstPtr

Definition at line 86 of file typedef.hpp.

typedef boost::shared_ptr<Indices> robot_model_services::IndicesPtr

Definition at line 85 of file typedef.hpp.

typedef boost::shared_ptr<MapHelper> robot_model_services::MapHelperPtr

Definition at line 405 of file MapHelper.hpp.

Definition at line 168 of file MILDRobotModel.hpp.

Definition at line 47 of file MILDRobotModelWithApproximatedIKFactory.hpp.

Definition at line 55 of file MILDRobotModelWithApproximatedIK.hpp.

Definition at line 48 of file MILDRobotModelWithExactIKFactory.hpp.

Definition at line 191 of file MILDRobotModelWithExactIK.hpp.

Definition at line 38 of file MILDRobotState.hpp.

Definition for the shared pointer type of the class.

Definition at line 64 of file NavigationPathIKRatingModule.h.

typedef RealObjectPoint robot_model_services::ObjectPoint

Definition at line 73 of file typedef.hpp.

typedef std::vector<std::string> robot_model_services::ObjectTypeList

Definition at line 89 of file typedef.hpp.

Definition at line 90 of file typedef.hpp.

Definition at line 93 of file typedef.hpp.

Definition at line 94 of file typedef.hpp.

Definition at line 91 of file typedef.hpp.

Definition at line 92 of file typedef.hpp.

Definition at line 33 of file typedef.hpp.

typedef std::tuple<double,double> robot_model_services::PTUConfig

MILDRobotModelWithExactIK implements a model of pan tilt unit robot where the inverse kinematic is calculated exactly.

Author:
Florian Aumann
Date:
10.2015
Version:
1.0

Definition at line 40 of file MILDRobotModelWithExactIK.hpp.

Definition at line 59 of file MapHelper.hpp.

Definition at line 58 of file MapHelper.hpp.

Definition at line 31 of file RobotModelAbstractFactory.hpp.

typedef boost::shared_ptr<RobotModel> robot_model_services::RobotModelPtr

Definition for the shared pointer type of the class.

Definition at line 132 of file RobotModel.hpp.

typedef boost::shared_ptr<RobotState> robot_model_services::RobotStatePtr

Definition at line 32 of file RobotState.hpp.

typedef SpaceSamplePoint robot_model_services::SamplePoint

Definition at line 77 of file typedef.hpp.

Definition for the shared pointer type of the class.

Definition at line 62 of file SimpleIKRatingModule.h.

typedef Eigen::Matrix<Precision, 2, 2> robot_model_services::SimpleMatrix2

Definition at line 36 of file typedef.hpp.

typedef Eigen::Matrix<Precision, 3, 3> robot_model_services::SimpleMatrix3

Definition at line 37 of file typedef.hpp.

typedef std::vector<SimpleMatrix3, Eigen::aligned_allocator<SimpleMatrix3> > robot_model_services::SimpleMatrix3Collection

Definition at line 42 of file typedef.hpp.

Definition at line 43 of file typedef.hpp.

typedef Eigen::Matrix<Precision, 4, 4> robot_model_services::SimpleMatrix4

Definition at line 38 of file typedef.hpp.

typedef std::vector<SimpleMatrix4, Eigen::aligned_allocator<SimpleMatrix4> > robot_model_services::SimpleMatrix4Collection

Definition at line 45 of file typedef.hpp.

Definition at line 46 of file typedef.hpp.

typedef Eigen::Matrix<Precision, Eigen::Dynamic, Eigen::Dynamic> robot_model_services::SimpleMatrixX

Definition at line 39 of file typedef.hpp.

Definition at line 64 of file typedef.hpp.

Definition at line 67 of file typedef.hpp.

Definition at line 68 of file typedef.hpp.

Definition at line 51 of file typedef.hpp.

typedef Eigen::Matrix<Precision, 2, 1> robot_model_services::SimpleVector2

Definition at line 49 of file typedef.hpp.

typedef Eigen::Matrix<Precision, 3, 1> robot_model_services::SimpleVector3

Definition at line 50 of file typedef.hpp.

typedef std::vector<SimpleVector3, Eigen::aligned_allocator<SimpleVector3> > robot_model_services::SimpleVector3Collection

Definition at line 57 of file typedef.hpp.

Definition at line 58 of file typedef.hpp.

typedef Eigen::Matrix<Precision, 4, 1> robot_model_services::SimpleVector4

Definition at line 52 of file typedef.hpp.

typedef std::vector<SimpleVector4, Eigen::aligned_allocator<SimpleVector4> > robot_model_services::SimpleVector4Collection

Definition at line 60 of file typedef.hpp.

Definition at line 61 of file typedef.hpp.

typedef Eigen::Matrix<Precision, Eigen::Dynamic, 1> robot_model_services::SimpleVectorX

Definition at line 53 of file typedef.hpp.

typedef std::vector<float> robot_model_services::SquaredDistances

Definition at line 81 of file typedef.hpp.

typedef DefaultViewportPoint robot_model_services::ViewportPoint

Definition at line 78 of file typedef.hpp.

Definition at line 97 of file typedef.hpp.

typedef boost::shared_ptr<VoxelGrid> robot_model_services::VoxelGridPtr

Definition at line 98 of file typedef.hpp.


Function Documentation

std::ostream & robot_model_services::operator<< ( std::ostream &  strm,
const robot_model_services::MILDRobotState r 
)

Definition at line 28 of file MILDRobotState.cpp.

std::ostream & robot_model_services::operator<< ( std::ostream &  strm,
const robot_model_services::MILDRobotStatePtr r 
)

Definition at line 37 of file MILDRobotState.cpp.



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 Sat Jun 8 2019 18:24:53