CombinatorialOptimizer.h
Go to the documentation of this file.
1 
18 #pragma once
19 
20 #include <boost/filesystem.hpp> // needed by RecordHunt, SimulatedAnnealing
21 
22 #include <topology_creator/TopologyCreator.h>
23 
24 #include <ISM/combinatorial_optimization/HillClimbingAlogrithm.hpp>
25 #include <ISM/combinatorial_optimization/RecordHuntAlgorithm.hpp>
26 #include <ISM/combinatorial_optimization/CostDeltaAcceptanceFunction.hpp>
27 #include <ISM/combinatorial_optimization/SimulatedAnnealingAlgorithm.hpp>
28 #include <ISM/combinatorial_optimization/ExponentialCoolingSchedule.hpp>
29 
30 #include <ISM/common_type/ObjectSet.hpp>
31 
39 
40 #include "helper/PrintHelper.h"
41 
43 
49 
50 public:
58  std::vector<std::string> pObjectTypes, std::vector<boost::shared_ptr<ISM::ObjectSet>> pExamplesList);
59 
64 
70 
71 private:
72 
78  void initTestSets(const std::vector<std::string>& pObjectTypes, const std::vector<boost::shared_ptr<ISM::ObjectSet>>& pExamplesList);
79 
86 
91  void initStarTopologies();
92 
98  void initStartingTopologies(unsigned int pNumberOfStartingTopologies, const std::string& pStartingTopologiesType);
99 
104  void initCostFunction(const std::string& pType);
105 
110  void initNeighbourhoodFunction(const std::string& pType);
111 
116  void initOptimizationAlgorithm(const std::string& pType);
117 
123  void optimize(boost::shared_ptr<SceneModel::Topology> pStartingTopology, unsigned int pStartingTopologyNumber);
124 
129 
133  std::vector<boost::shared_ptr<SceneModel::Topology>> mStarTopologies;
134 
139 
143  std::vector<boost::shared_ptr<SceneModel::Topology>> mStartingTopologies;
144 
149 
154 
164 
169 
173  unsigned int mMinFalsePositives; // set in ctor
177  unsigned int mMinFalseNegatives; // set in ctor
181  double mMinAverageRecognitionRuntime; // set in ctor
186  unsigned int mMaxFalsePositives; // set in initStar
191  unsigned int mMaxFalseNegatives; // set in initStar
196  double mMaxAverageRecognitionRuntime; // set in initFullyMeshed
201 
206 
212 
217 
222 
227 
232 
238 
243 };
244 
245 }
boost::shared_ptr< ISM::CostFunction< boost::shared_ptr< SceneModel::Topology > > > mCostFunction
void initStartingTopologies(unsigned int pNumberOfStartingTopologies, const std::string &pStartingTopologiesType)
boost::shared_ptr< ISM::NeighbourhoodFunction< boost::shared_ptr< SceneModel::Topology > > > mNeighbourhoodFunction
void initTestSets(const std::vector< std::string > &pObjectTypes, const std::vector< boost::shared_ptr< ISM::ObjectSet >> &pExamplesList)
CombinatorialOptimizer(std::vector< boost::shared_ptr< SceneObjectLearner >> pLearners, std::vector< std::string > pObjectTypes, std::vector< boost::shared_ptr< ISM::ObjectSet >> pExamplesList)
boost::shared_ptr< SceneModel::Topology > mFullyMeshedTopology
boost::shared_ptr< SceneModel::Topology > runOptimization()
boost::shared_ptr< SceneModel::Topology > mBestOptimizedTopology
boost::shared_ptr< AbstractTopologyEvaluator > mEvaluator
boost::shared_ptr< SceneModel::Topology > mWorstStarIfRequested
void optimize(boost::shared_ptr< SceneModel::Topology > pStartingTopology, unsigned int pStartingTopologyNumber)
std::vector< boost::shared_ptr< SceneModel::Topology > > mStarTopologies
std::vector< boost::shared_ptr< SceneModel::Topology > > mStartingTopologies
boost::shared_ptr< ISM::OptimizationAlgorithm< boost::shared_ptr< SceneModel::Topology > > > mOptimizationAlgorithm


asr_psm
Author(s): Braun Kai, Gehrung Joachim, Heizmann Heinrich, Meißner Pascal
autogenerated on Fri Nov 15 2019 03:57:54