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 |
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) |
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:
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 boost::shared_ptr<AngleApproximationIKRatingModule> robot_model_services::AngleApproximationIKRatingModulePtr |
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.
Definition at line 85 of file typedef.hpp.
Definition at line 405 of file MapHelper.hpp.
Definition at line 168 of file MILDRobotModel.hpp.
typedef boost::shared_ptr<MILDRobotModelWithApproximatedIKFactory> robot_model_services::MILDRobotModelWithApproximatedIKFactoryPtr |
Definition at line 47 of file MILDRobotModelWithApproximatedIKFactory.hpp.
typedef boost::shared_ptr<MILDRobotModelWithApproximatedIK> robot_model_services::MILDRobotModelWithApproximatedIKPtr |
Definition at line 55 of file MILDRobotModelWithApproximatedIK.hpp.
typedef boost::shared_ptr<MILDRobotModelWithExactIKFactory> robot_model_services::MILDRobotModelWithExactIKFactoryPtr |
Definition at line 48 of file MILDRobotModelWithExactIKFactory.hpp.
typedef boost::shared_ptr<MILDRobotModelWithExactIK> robot_model_services::MILDRobotModelWithExactIKPtr |
Definition at line 191 of file MILDRobotModelWithExactIK.hpp.
Definition at line 38 of file MILDRobotState.hpp.
typedef boost::shared_ptr<NavigationPathIKRatingModule> robot_model_services::NavigationPathIKRatingModulePtr |
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.
typedef std::set<std::string> robot_model_services::ObjectTypeSet |
Definition at line 91 of file typedef.hpp.
Definition at line 92 of file typedef.hpp.
typedef float robot_model_services::Precision |
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.
Definition at line 40 of file MILDRobotModelWithExactIK.hpp.
typedef std::vector<RayTracingIndex> robot_model_services::Ray |
Definition at line 59 of file MapHelper.hpp.
Definition at line 58 of file MapHelper.hpp.
typedef boost::shared_ptr<RobotModelAbstractFactory> robot_model_services::RobotModelAbstractFactoryPtr |
Definition at line 31 of file RobotModelAbstractFactory.hpp.
Definition for the shared pointer type of the class.
Definition at line 132 of file RobotModel.hpp.
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.
typedef Eigen::Quaternion<Precision> robot_model_services::SimpleQuaternion |
Definition at line 64 of file typedef.hpp.
typedef std::vector<SimpleQuaternion, Eigen::aligned_allocator<SimpleQuaternion> > robot_model_services::SimpleQuaternionCollection |
Definition at line 67 of file typedef.hpp.
typedef boost::shared_ptr<SimpleQuaternionCollection> robot_model_services::SimpleQuaternionCollectionPtr |
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.
Definition at line 98 of file typedef.hpp.
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.