Classes | Typedefs | Enumerations | Functions
ISM Namespace Reference

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

Classes

class  AcceptanceFunction
 
class  APORater
 
class  BaseRater
 
class  Cluster
 
struct  CollectedData
 
class  CombinatorialTrainer
 
struct  CombinatorialTrainerParameters
 
class  ConnectivityChecker
 
class  CoolingSchedule
 
class  CostDeltaAcceptanceFunction
 
class  CostFunction
 
struct  CostFunctionParameters
 
class  DataCleaner
 
class  DataCollector
 
class  DataMerger
 
class  DirectionOrientationRelationHeuristic
 
class  DirectionRelationHeuristic
 
class  DocumentationHelper
 
class  DotHelper
 
struct  EvaluationResult
 
class  Evaluator
 
struct  EvaluatorParameters
 
class  ExponentialCoolingSchedule
 
struct  FalseNegative
 
struct  FalsePositive
 
class  GeometryHelper
 
class  HeightChecker
 
class  Heuristic
 
class  HillClimbingAlogrithm
 
struct  ImplicitShapeModel
 
class  json
 
class  LogHelper
 
class  ManuallyDefPseudoHeuristic
 
class  MarkerRotator
 
class  MathHelper
 
class  NeighbourhoodFunction
 
class  Object
 
class  ObjectRelation
 
struct  ObjectSet
 
class  ObjectSetValidator
 
class  OptimizationAlgorithm
 
struct  OptimizationAlgorithmParameters
 
class  OptimizationRunner
 
class  OptimizationRunnerFactory
 
struct  Pattern
 
class  Point
 
class  Pose
 
class  PoseInterpolator
 
class  Quaternion
 
struct  RatingData
 
struct  RecognitionResult
 
class  Recognizer
 
class  RecordedObjectsTransformer
 
class  RecordedPattern
 
class  Recorder
 
class  RecordHuntAlgorithm
 
class  RotationInvariantObjectsRotator
 
class  Serializable
 
class  SimpleRater
 
class  SimulatedAnnealingAlgorithm
 
class  StaticRelationHeuristic
 
class  SVGHelper
 
class  TableHelper
 
class  Tester
 
class  TestSetGenerator
 
class  Topology
 
class  TopologyGenerator
 
class  TopologyGeneratorNaive
 
class  TopologyGeneratorPaper
 
struct  TopologyGeneratorParameters
 
class  TopologyManager
 
struct  TopologyValidationResult
 
struct  Track
 
class  Tracks
 
struct  TracksWithRef
 
class  Trainer
 
class  Tree
 
class  TreeValidator
 
struct  TreeValidatorParameters
 
struct  VotedPose
 
struct  VoteSpecifier
 
class  VotingBin
 
struct  VotingResult
 
class  VotingResultCalculator
 
class  VotingSpace
 
class  WeightedSum
 

Typedefs

typedef boost::shared_ptr< AcceptanceFunctionAcceptanceFunctionPtr
 
typedef boost::shared_ptr< ClusterClusterPtr
 
typedef boost::shared_ptr< CollectedDataCollectedDataPtr
 
typedef boost::shared_ptr< CombinatorialTrainerCombinatorialTrainerPtr
 
typedef boost::shared_ptr< ConnectivityCheckerConnectivityCheckerPtr
 
typedef boost::shared_ptr< CoolingScheduleCoolingSchedulePtr
 
typedef boost::shared_ptr< CostDeltaAcceptanceFunctionCostDeltaAcceptanceFunctionPtr
 
template<class InstanceType >
using CostFunctionPtr = boost::shared_ptr< CostFunction< InstanceType >>
 
typedef std::pair< unsigned int, double > CountWeightPair
 
typedef boost::uniform_int DIST
 
typedef boost::shared_ptr< DocumentationHelperDocumentationHelperPtr
 
typedef boost::shared_ptr< DotHelperDotHelperPtr
 
typedef boost::mt19937 ENG
 
typedef boost::shared_ptr< EvaluatorEvaluatorPtr
 
typedef boost::shared_ptr< ExponentialCoolingScheduleExponentialCoolingSchedulePtr
 
typedef boost::shared_ptr< FalseNegativeFalseNegativePtr
 
typedef boost::shared_ptr< FalsePositiveFalsePositivePtr
 
typedef boost::variate_generator< ENG, DISTGEN
 
typedef GeometryHelper GH
 
typedef boost::shared_ptr< HeuristicHeuristicPtr
 
template<class InstanceType >
using HillClimbingAlogrithmPtr = boost::shared_ptr< HillClimbingAlogrithm< InstanceType >>
 
typedef std::map< std::string, VotedPosePtrsIdToVoteMap
 
typedef boost::shared_ptr< ImplicitShapeModelIsmPtr
 
typedef boost::shared_ptr< jsonjsonPtr
 
typedef boost::shared_ptr< LogHelperLogHelperPtr
 
template<class InstanceType >
using NeighbourhoodFunctionPtr = boost::shared_ptr< NeighbourhoodFunction< InstanceType >>
 
typedef boost::shared_ptr< ObjectObjectPtr
 
typedef boost::shared_ptr< ISM::ObjectRelationObjectRelationPtr
 
typedef std::map< unsigned int, ISM::ObjectRelationPtr, std::less< unsigned > > ObjectRelations
 
typedef boost::shared_ptr< ObjectSetObjectSetPtr
 
typedef boost::shared_ptr< ObjectSetValidatorObjectSetValidatorPtr
 
typedef std::map< std::string, std::map< std::string, std::vector< VoteSpecifierPtr > > > ObjectToVoteMap
 
typedef std::map< std::string, std::vector< VoteSpecifierPtr > > ObjectTypeToVoteMap
 
template<class InstanceType >
using OptimizationAlgorithmPtr = boost::shared_ptr< OptimizationAlgorithm< InstanceType >>
 
typedef boost::shared_ptr< OptimizationRunnerOptimizationRunnerPtr
 
typedef std::pair< std::string, VotingSpacePtrPatternNameAndVotingSpaceTuple
 
typedef std::map< std::string, std::vector< ObjectSetPtr > > PatternNameToObjectSet
 
typedef std::map< std::string, PatternPtrPatternNameToPatternMap
 
typedef std::map< std::string, VotedPosePtrsPatternNameToVotedPoses
 
typedef boost::shared_ptr< PatternPatternPtr
 
typedef std::map< std::string, std::map< std::string, std::map< std::string, std::vector< VoteSpecifierPtr > > > > PatternToObjectToVoteMap
 
typedef boost::shared_ptr< PointPointPtr
 
typedef std::vector< PointPtrPointPtrs
 
typedef boost::shared_ptr< PosePosePtr
 
typedef boost::shared_ptr< QuaternionQuaternionPtr
 
typedef boost::shared_ptr< BaseRaterRaterPtr
 
typedef boost::shared_ptr< RatingDataRatingDataPtr
 
typedef boost::shared_ptr< RecognitionResultRecognitionResultPtr
 
typedef boost::shared_ptr< RecognizerRecognizerPtr
 
typedef boost::shared_ptr< RecordedPatternRecordedPatternPtr
 
typedef boost::shared_ptr< RecorderRecorderPtr
 
template<class InstanceType >
using RecordHuntAlgorithmPtr = boost::shared_ptr< RecordHuntAlgorithm< InstanceType >>
 
typedef boost::shared_ptr< SerializableSerializablePtr
 
template<class InstanceType >
using SimulatedAnnealingAlgorithmPtr = boost::shared_ptr< SimulatedAnnealingAlgorithm< InstanceType >>
 
typedef std::pair< VotedPosePtr, CountWeightPairSummarizedVotedPosePtr
 
typedef std::vector< SummarizedVotedPosePtrSummarizedVotedPosePtrs
 
typedef boost::shared_ptr< SVGHelperSVGHelperPtr
 
typedef boost::shared_ptr< TableHelperTableHelperPtr
 
typedef boost::shared_ptr< TesterTesterPtr
 
typedef std::map< std::string, std::vector< ISM::ObjectSetPtr > > TestSet
 
typedef boost::shared_ptr< TestSetGeneratorTestSetGeneratorPtr
 
typedef boost::shared_ptr< TopologyGeneratorNaiveTopologyGeneratorNaivePtr
 
typedef boost::shared_ptr< TopologyGeneratorPaperTopologyGeneratorPaperPtr
 
typedef boost::shared_ptr< TopologyGeneratorTopologyGeneratorPtr
 
typedef boost::shared_ptr< TopologyManagerTopologyManagerPtr
 
typedef boost::shared_ptr< TopologyTopologyPtr
 
typedef boost::shared_ptr< TopologyValidationResultTopologyValidationResultPtr
 
typedef std::map< int, TopologyValidationResultPtr, std::less< unsigned > > TopologyValidationResults
 
typedef boost::shared_ptr< TopologyValidationResultsTopologyValidationResultsPtr
 
typedef boost::shared_ptr< TrackTrackPtr
 
typedef boost::shared_ptr< TracksTracksPtr
 
typedef boost::shared_ptr< TracksWithRefTracksWithRefPtr
 
typedef boost::shared_ptr< TrainerTrainerPtr
 
typedef std::map< unsigned int, std::set< std::string > > TreeHeightToPatternName
 
typedef boost::shared_ptr< TreeTreePtr
 
typedef boost::shared_ptr< TreeValidatorTreeValidatorPtr
 
typedef std::map< std::string, IdToVoteMapTypeToInnerMap
 
typedef boost::shared_ptr< VotedPoseVotedPosePtr
 
typedef std::vector< VotedPosePtrVotedPosePtrs
 
typedef boost::shared_ptr< VoteSpecifierVoteSpecifierPtr
 
typedef boost::shared_ptr< VotingBinVotingBinPtr
 
typedef boost::shared_ptr< VotingResultCalculatorVotingResultCalculatorPtr
 
typedef boost::shared_ptr< VotingResultVotingResultPtr
 
typedef std::vector< VotingResultPtrVotingResultPtrs
 
typedef boost::shared_ptr< VotingSpaceVotingSpacePtr
 
typedef boost::shared_ptr< WeightedSumWeightedSumPtr
 
typedef std::map< int, YIndexToZIndexXIndexToYIndex
 
typedef std::map< int, ZIndexToVotingBinPtrYIndexToZIndex
 
typedef std::map< int, VotingBinPtrZIndexToVotingBinPtr
 

Enumerations

enum  LogLevel {
  LOG_FATAL, LOG_ERROR, LOG_WARNING, LOG_INFO,
  LOG_DEBUG
}
 

Functions

std::ostream & operator<< (std::ostream &strm, const ISM::json &s)
 
std::ostream & operator<< (std::ostream &strm, const ISM::Pattern &p)
 
std::ostream & operator<< (std::ostream &strm, const ISM::VoteSpecifier &v)
 
std::ostream & operator<< (std::ostream &strm, const ISM::VotedPose &v)
 
std::ostream & operator<< (std::ostream &strm, const ISM::Object &o)
 
std::ostream & operator<< (std::ostream &strm, const ISM::Pose &p)
 
std::ostream & operator<< (std::ostream &strm, const ISM::Quaternion &q)
 
std::ostream & operator<< (std::ostream &strm, const ISM::PatternPtr &p)
 
std::ostream & operator<< (std::ostream &strm, const ISM::jsonPtr &s)
 
std::ostream & operator<< (std::ostream &strm, const ISM::ObjectPtr &o)
 
std::ostream & operator<< (std::ostream &strm, const ISM::PosePtr &p)
 
std::ostream & operator<< (std::ostream &strm, const ISM::QuaternionPtr &q)
 
std::ostream & operator<< (std::ostream &strm, const ISM::Point &p)
 
std::ostream & operator<< (std::ostream &strm, const ISM::ObjectSet &o)
 
std::ostream & operator<< (std::ostream &strm, const ISM::VotedPosePtr &v)
 
std::ostream & operator<< (std::ostream &strm, const ISM::PointPtr &p)
 
std::ostream & operator<< (std::ostream &strm, const ISM::VoteSpecifierPtr &v)
 
std::ostream & operator<< (std::ostream &strm, const ISM::Track &o)
 
std::ostream & operator<< (std::ostream &strm, const ISM::ObjectSetPtr &o)
 
std::ostream & operator<< (std::ostream &strm, const ISM::TrackPtr &o)
 
std::ostream & operator<< (std::ostream &strm, ISM::RecognitionResult &r)
 
std::ostream & operator<< (std::ostream &strm, ISM::RecognitionResultPtr &r)
 
std::ostream & operator<< (std::ostream &strm, const ISM::ObjectRelation &r)
 
std::ostream & operator<< (std::ostream &strm, const ISM::ObjectRelationPtr &r)
 
std::ostream & operator<< (std::ostream &strm, const ISM::ObjectRelations &r)
 
bool operator== (const PosePtr &pose1, const PosePtr &pose2)
 
bool operator== (const QuaternionPtr &q1, const QuaternionPtr &q2)
 
bool operator== (const Pose &pose1, const Pose &pose2)
 
bool operator== (const PointPtr &p1, const PointPtr &p2)
 
bool operator== (const Quaternion &q1, const Quaternion &q2)
 
bool operator== (const Point &p1, const Point &p2)
 
bool operator== (const RecognitionResultPtr &recogRes1, const RecognitionResultPtr &recogRes2)
 
bool operator== (const RecognitionResult &recogRes1, const RecognitionResult &recogRes2)
 
void printBlue (std::string text)
 
void printGreen (std::string text)
 
void printRed (std::string text)
 
void printYellow (std::string text)
 
bool sortObjectPtrAscAlpha (const ObjectPtr &lhs, const ObjectPtr &rhs)
 

Detailed Description

this namespace contains all generally usable classes.

Copyright (c) 2016, Hanselmann Fabian, Heller Florian, Heizmann Heinrich, Kübler Marcel, Mehlhaus Jonas, Meißner Pascal, Qattan Mohamad, Reckling Reno, Stroh Daniel 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.

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

typedef boost::shared_ptr<AcceptanceFunction> ISM::AcceptanceFunctionPtr

Definition at line 31 of file AcceptanceFunction.hpp.

typedef boost::shared_ptr<Cluster> ISM::ClusterPtr

Definition at line 53 of file Cluster.hpp.

typedef boost::shared_ptr<CollectedData> ISM::CollectedDataPtr

Definition at line 38 of file DataCollector.hpp.

Definition at line 111 of file CombinatorialTrainer.hpp.

Definition at line 59 of file ConnectivityChecker.hpp.

typedef boost::shared_ptr<CoolingSchedule> ISM::CoolingSchedulePtr

Definition at line 50 of file CoolingSchedule.hpp.

Definition at line 45 of file CostDeltaAcceptanceFunction.hpp.

template<class InstanceType >
using ISM::CostFunctionPtr = typedef boost::shared_ptr<CostFunction<InstanceType>>

Definition at line 33 of file CostFunction.hpp.

typedef std::pair<unsigned int, double> ISM::CountWeightPair

Definition at line 73 of file typedef.hpp.

typedef boost::uniform_int ISM::DIST

Definition at line 45 of file TestSetGenerator.hpp.

Definition at line 93 of file DocumentationHelper.hpp.

typedef boost::shared_ptr<DotHelper> ISM::DotHelperPtr

Definition at line 50 of file DotHelper.hpp.

typedef boost::mt19937 ISM::ENG

Definition at line 44 of file TestSetGenerator.hpp.

typedef boost::shared_ptr<Evaluator> ISM::EvaluatorPtr

Definition at line 35 of file Evaluator.hpp.

Definition at line 45 of file CostDifferenceDeltaAcceptanceFunction.hpp.

typedef boost::shared_ptr<FalseNegative> ISM::FalseNegativePtr

Definition at line 46 of file TopologyValidationResultContainer.hpp.

typedef boost::shared_ptr<FalsePositive> ISM::FalsePositivePtr

Definition at line 45 of file TopologyValidationResultContainer.hpp.

typedef boost::variate_generator<ENG,DIST> ISM::GEN

Definition at line 46 of file TestSetGenerator.hpp.

Definition at line 23 of file VotingResultCalculator.cpp.

typedef boost::shared_ptr<Heuristic> ISM::HeuristicPtr

Definition at line 44 of file Heuristic.hpp.

template<class InstanceType >
using ISM::HillClimbingAlogrithmPtr = typedef boost::shared_ptr<HillClimbingAlogrithm<InstanceType>>

Definition at line 93 of file HillClimbingAlogrithm.hpp.

typedef std::map<std::string, VotedPosePtrs> ISM::IdToVoteMap

Definition at line 70 of file typedef.hpp.

typedef boost::shared_ptr<ImplicitShapeModel> ISM::IsmPtr

Definition at line 89 of file ImplicitShapeModel.hpp.

typedef boost::shared_ptr<json> ISM::jsonPtr

Definition at line 32 of file JsonStream.hpp.

typedef boost::shared_ptr<LogHelper> ISM::LogHelperPtr

Definition at line 49 of file typedef.hpp.

template<class InstanceType >
using ISM::NeighbourhoodFunctionPtr = typedef boost::shared_ptr<NeighbourhoodFunction<InstanceType>>

Definition at line 34 of file NeighbourhoodFunction.hpp.

typedef boost::shared_ptr<Object> ISM::ObjectPtr

Definition at line 82 of file Object.hpp.

typedef boost::shared_ptr<ISM::ObjectRelation> ISM::ObjectRelationPtr

Definition at line 74 of file ObjectRelation.hpp.

typedef std::map<unsigned int, ISM::ObjectRelationPtr, std::less<unsigned> > ISM::ObjectRelations

Definition at line 75 of file ObjectRelation.hpp.

typedef boost::shared_ptr< ObjectSet > ISM::ObjectSetPtr

Definition at line 53 of file ObjectSet.hpp.

typedef boost::shared_ptr<ObjectSetValidator> ISM::ObjectSetValidatorPtr

Definition at line 43 of file ObjectSetValidator.hpp.

typedef std::map<std::string, std::map<std::string, std::vector<VoteSpecifierPtr> > > ISM::ObjectToVoteMap

Definition at line 39 of file TableHelper.hpp.

typedef std::map<std::string, std::vector<VoteSpecifierPtr> > ISM::ObjectTypeToVoteMap

Definition at line 36 of file TableHelper.hpp.

template<class InstanceType >
using ISM::OptimizationAlgorithmPtr = typedef boost::shared_ptr<OptimizationAlgorithm<InstanceType>>

Definition at line 45 of file OptimizationAlgorithm.hpp.

typedef boost::shared_ptr<OptimizationRunner> ISM::OptimizationRunnerPtr

Definition at line 115 of file OptimizationRunner.hpp.

typedef std::pair<std::string, VotingSpacePtr> ISM::PatternNameAndVotingSpaceTuple

Definition at line 63 of file typedef.hpp.

typedef std::map<std::string, std::vector<ObjectSetPtr> > ISM::PatternNameToObjectSet

Definition at line 68 of file typedef.hpp.

typedef std::map<std::string, PatternPtr> ISM::PatternNameToPatternMap

Definition at line 37 of file TableHelper.hpp.

typedef std::map<std::string, VotedPosePtrs> ISM::PatternNameToVotedPoses

Definition at line 65 of file typedef.hpp.

typedef boost::shared_ptr<Pattern> ISM::PatternPtr

Definition at line 36 of file Pattern.hpp.

typedef std::map<std::string, std::map<std::string, std::map<std::string, std::vector<VoteSpecifierPtr> > > > ISM::PatternToObjectToVoteMap

Definition at line 41 of file TableHelper.hpp.

typedef boost::shared_ptr< Point > ISM::PointPtr

Definition at line 45 of file Point.hpp.

typedef std::vector<PointPtr> ISM::PointPtrs

Definition at line 61 of file typedef.hpp.

typedef boost::shared_ptr<Pose> ISM::PosePtr

Definition at line 79 of file Pose.hpp.

typedef boost::shared_ptr<Quaternion> ISM::QuaternionPtr

Definition at line 39 of file Quaternion.hpp.

typedef boost::shared_ptr<BaseRater> ISM::RaterPtr

Definition at line 91 of file BaseRater.hpp.

typedef boost::shared_ptr<RatingData> ISM::RatingDataPtr

Definition at line 38 of file RatingData.hpp.

typedef boost::shared_ptr< RecognitionResult > ISM::RecognitionResultPtr

Definition at line 35 of file RecognitionResult.hpp.

typedef boost::shared_ptr<Recognizer> ISM::RecognizerPtr

Definition at line 171 of file Recognizer.hpp.

typedef boost::shared_ptr<RecordedPattern> ISM::RecordedPatternPtr

Definition at line 41 of file RecordedPattern.hpp.

typedef boost::shared_ptr<Recorder> ISM::RecorderPtr

Definition at line 52 of file Recorder.hpp.

template<class InstanceType >
using ISM::RecordHuntAlgorithmPtr = typedef boost::shared_ptr<RecordHuntAlgorithm<InstanceType>>

Definition at line 99 of file RecordHuntAlgorithm.hpp.

typedef boost::shared_ptr<Serializable> ISM::SerializablePtr

Definition at line 29 of file Serializable.hpp.

template<class InstanceType >
using ISM::SimulatedAnnealingAlgorithmPtr = typedef boost::shared_ptr<SimulatedAnnealingAlgorithm<InstanceType>>

Definition at line 98 of file SimulatedAnnealingAlgorithm.hpp.

Definition at line 74 of file typedef.hpp.

Definition at line 75 of file typedef.hpp.

typedef boost::shared_ptr<SVGHelper> ISM::SVGHelperPtr

Definition at line 140 of file SVGHelper.hpp.

typedef boost::shared_ptr<TableHelper> ISM::TableHelperPtr

Definition at line 184 of file TableHelper.hpp.

typedef boost::shared_ptr<Tester> ISM::TesterPtr

Definition at line 63 of file Tester.hpp.

typedef std::map<std::string, std::vector<ISM::ObjectSetPtr> > ISM::TestSet

Definition at line 43 of file TestSetGenerator.hpp.

typedef boost::shared_ptr<TestSetGenerator> ISM::TestSetGeneratorPtr

Definition at line 69 of file TestSetGenerator.hpp.

Definition at line 38 of file TopologyGeneratorNaive.hpp.

Definition at line 48 of file TopologyGeneratorPaper.hpp.

typedef boost::shared_ptr<TopologyGenerator> ISM::TopologyGeneratorPtr

Definition at line 71 of file TopologyGenerator.hpp.

typedef boost::shared_ptr<TopologyManager> ISM::TopologyManagerPtr

Definition at line 96 of file TopologyManager.hpp.

typedef boost::shared_ptr<Topology> ISM::TopologyPtr

Definition at line 51 of file Topology.hpp.

Definition at line 53 of file TopologyValidationResultContainer.hpp.

typedef std::map<int, TopologyValidationResultPtr, std::less<unsigned> > ISM::TopologyValidationResults

Definition at line 54 of file TopologyValidationResultContainer.hpp.

Definition at line 55 of file TopologyValidationResultContainer.hpp.

typedef boost::shared_ptr<Track> ISM::TrackPtr

Definition at line 55 of file Track.hpp.

typedef boost::shared_ptr<Tracks> ISM::TracksPtr

Definition at line 42 of file Tracks.hpp.

typedef boost::shared_ptr<TracksWithRef> ISM::TracksWithRefPtr

Definition at line 31 of file DataCollector.hpp.

typedef boost::shared_ptr<Trainer> ISM::TrainerPtr

Definition at line 83 of file Trainer.hpp.

typedef std::map<unsigned int, std::set<std::string> > ISM::TreeHeightToPatternName

Definition at line 66 of file typedef.hpp.

typedef boost::shared_ptr<Tree> ISM::TreePtr

Definition at line 46 of file typedef.hpp.

typedef boost::shared_ptr<TreeValidator> ISM::TreeValidatorPtr

Definition at line 33 of file TreeValidator.hpp.

typedef std::map<std::string, IdToVoteMap> ISM::TypeToInnerMap

Definition at line 71 of file typedef.hpp.

typedef boost::shared_ptr<VotedPose> ISM::VotedPosePtr

Definition at line 31 of file typedef.hpp.

typedef std::vector<VotedPosePtr> ISM::VotedPosePtrs

Definition at line 59 of file typedef.hpp.

typedef boost::shared_ptr<VoteSpecifier> ISM::VoteSpecifierPtr

Definition at line 81 of file VoteSpecifier.hpp.

typedef boost::shared_ptr<VotingBin> ISM::VotingBinPtr

Definition at line 43 of file typedef.hpp.

Definition at line 140 of file VotingResultCalculator.hpp.

typedef boost::shared_ptr<VotingResult> ISM::VotingResultPtr

Definition at line 37 of file typedef.hpp.

typedef std::vector<VotingResultPtr> ISM::VotingResultPtrs

Definition at line 60 of file typedef.hpp.

typedef boost::shared_ptr<VotingSpace> ISM::VotingSpacePtr

Definition at line 34 of file typedef.hpp.

typedef boost::shared_ptr<WeightedSum> ISM::WeightedSumPtr

Definition at line 55 of file WeightedSum.hpp.

typedef std::map<int, YIndexToZIndex> ISM::XIndexToYIndex

Definition at line 79 of file typedef.hpp.

typedef std::map<int, ZIndexToVotingBinPtr> ISM::YIndexToZIndex

Definition at line 78 of file typedef.hpp.

typedef std::map<int, VotingBinPtr> ISM::ZIndexToVotingBinPtr

Definition at line 77 of file typedef.hpp.

Enumeration Type Documentation

Enumerator
LOG_FATAL 
LOG_ERROR 
LOG_WARNING 
LOG_INFO 
LOG_DEBUG 

Definition at line 35 of file LogHelper.hpp.

Function Documentation

std::ostream & ISM::operator<< ( std::ostream &  strm,
const ISM::json s 
)

Definition at line 21 of file JsonStream.cpp.

std::ostream & ISM::operator<< ( std::ostream &  strm,
const ISM::Pattern p 
)

Definition at line 21 of file Pattern.cpp.

std::ostream & ISM::operator<< ( std::ostream &  strm,
const ISM::VoteSpecifier v 
)

Definition at line 21 of file VoteSpecifier.cpp.

std::ostream & ISM::operator<< ( std::ostream &  strm,
const ISM::VotedPose v 
)

Definition at line 22 of file VotedPose.cpp.

std::ostream & ISM::operator<< ( std::ostream &  strm,
const ISM::Object o 
)

Definition at line 22 of file Object.cpp.

std::ostream & ISM::operator<< ( std::ostream &  strm,
const ISM::Pose p 
)

Definition at line 23 of file Pose.cpp.

std::ostream & ISM::operator<< ( std::ostream &  strm,
const ISM::Quaternion q 
)

Definition at line 23 of file Quaternion.cpp.

std::ostream & ISM::operator<< ( std::ostream &  strm,
const ISM::PatternPtr p 
)

Definition at line 25 of file Pattern.cpp.

std::ostream & ISM::operator<< ( std::ostream &  strm,
const ISM::jsonPtr s 
)

Definition at line 26 of file JsonStream.cpp.

std::ostream & ISM::operator<< ( std::ostream &  strm,
const ISM::ObjectPtr o 
)

Definition at line 26 of file Object.cpp.

std::ostream & ISM::operator<< ( std::ostream &  strm,
const ISM::PosePtr p 
)

Definition at line 27 of file Pose.cpp.

std::ostream & ISM::operator<< ( std::ostream &  strm,
const ISM::QuaternionPtr q 
)

Definition at line 27 of file Quaternion.cpp.

std::ostream & ISM::operator<< ( std::ostream &  strm,
const ISM::Point p 
)

Definition at line 27 of file Point.cpp.

std::ostream & ISM::operator<< ( std::ostream &  strm,
const ISM::ObjectSet o 
)

Definition at line 30 of file ObjectSet.cpp.

std::ostream & ISM::operator<< ( std::ostream &  strm,
const ISM::VotedPosePtr v 
)

Definition at line 30 of file VotedPose.cpp.

std::ostream & ISM::operator<< ( std::ostream &  strm,
const ISM::PointPtr p 
)

Definition at line 31 of file Point.cpp.

std::ostream & ISM::operator<< ( std::ostream &  strm,
const ISM::VoteSpecifierPtr v 
)

Definition at line 34 of file VoteSpecifier.cpp.

std::ostream & ISM::operator<< ( std::ostream &  strm,
const ISM::Track o 
)

Definition at line 35 of file Track.cpp.

std::ostream & ISM::operator<< ( std::ostream &  strm,
const ISM::ObjectSetPtr o 
)

Definition at line 40 of file ObjectSet.cpp.

std::ostream & ISM::operator<< ( std::ostream &  strm,
const ISM::TrackPtr o 
)

Definition at line 49 of file Track.cpp.

std::ostream & ISM::operator<< ( std::ostream &  strm,
ISM::RecognitionResult r 
)

Definition at line 57 of file RecognitionResult.cpp.

std::ostream & ISM::operator<< ( std::ostream &  strm,
ISM::RecognitionResultPtr r 
)

Definition at line 77 of file RecognitionResult.cpp.

std::ostream & ISM::operator<< ( std::ostream &  strm,
const ISM::ObjectRelation r 
)

Definition at line 167 of file ObjectRelation.cpp.

std::ostream & ISM::operator<< ( std::ostream &  strm,
const ISM::ObjectRelationPtr r 
)

Definition at line 172 of file ObjectRelation.cpp.

std::ostream & ISM::operator<< ( std::ostream &  strm,
const ISM::ObjectRelations r 
)

Definition at line 176 of file ObjectRelation.cpp.

bool ISM::operator== ( const PosePtr pose1,
const PosePtr pose2 
)

Definition at line 31 of file Pose.cpp.

bool ISM::operator== ( const QuaternionPtr q1,
const QuaternionPtr q2 
)

Definition at line 35 of file Quaternion.cpp.

bool ISM::operator== ( const Pose pose1,
const Pose pose2 
)

Definition at line 36 of file Pose.cpp.

bool ISM::operator== ( const PointPtr p1,
const PointPtr p2 
)

Definition at line 39 of file Point.cpp.

bool ISM::operator== ( const Quaternion q1,
const Quaternion q2 
)

Definition at line 40 of file Quaternion.cpp.

bool ISM::operator== ( const Point p1,
const Point p2 
)

Definition at line 44 of file Point.cpp.

bool ISM::operator== ( const RecognitionResultPtr recogRes1,
const RecognitionResultPtr recogRes2 
)

Definition at line 81 of file RecognitionResult.cpp.

bool ISM::operator== ( const RecognitionResult recogRes1,
const RecognitionResult recogRes2 
)

Definition at line 86 of file RecognitionResult.cpp.

void ISM::printBlue ( std::string  text)

Definition at line 37 of file Util.cpp.

void ISM::printGreen ( std::string  text)

Definition at line 29 of file Util.cpp.

void ISM::printRed ( std::string  text)

Definition at line 25 of file Util.cpp.

void ISM::printYellow ( std::string  text)

Definition at line 33 of file Util.cpp.

bool ISM::sortObjectPtrAscAlpha ( const ObjectPtr lhs,
const ObjectPtr rhs 
)

Definition at line 22 of file ObjectSet.cpp.



asr_lib_ism
Author(s): Hanselmann Fabian, Heller Florian, Heizmann Heinrich, Kübler Marcel, Mehlhaus Jonas, Meißner Pascal, Qattan Mohamad, Reckling Reno, Stroh Daniel
autogenerated on Wed Jan 8 2020 04:02:41