#include <gtwrap/matlab.h>
#include <map>
#include <boost/archive/text_iarchive.hpp>
#include <boost/archive/text_oarchive.hpp>
#include <boost/serialization/export.hpp>
#include <folder/path/to/Test.h>
#include <gtsam/geometry/Cal3Bundler.h>
#include <gtsam/geometry/Point2.h>
#include <gtsam/geometry/Point3.h>
#include <path/to/ns1.h>
#include <path/to/ns1/ClassB.h>
#include <path/to/ns2.h>
#include <path/to/ns2/ClassA.h>
#include <path/to/ns3.h>
Go to the source code of this file.
Functions | |
void | _deleteAllObjects () |
void | _special_cases_RTTIRegister () |
BOOST_CLASS_EXPORT_GUID (gtsam::Point2,"gtsamPoint2") | |
BOOST_CLASS_EXPORT_GUID (gtsam::Point3,"gtsamPoint3") | |
void | gtsamGeneralSFMFactorCal3Bundler_collectorInsertAndMakeBase_7 (int nargout, mxArray *out[], int nargin, const mxArray *in[]) |
void | gtsamGeneralSFMFactorCal3Bundler_deconstructor_8 (int nargout, mxArray *out[], int nargin, const mxArray *in[]) |
void | gtsamNonlinearFactorGraph_addPrior_2 (int nargout, mxArray *out[], int nargin, const mxArray *in[]) |
void | gtsamNonlinearFactorGraph_collectorInsertAndMakeBase_0 (int nargout, mxArray *out[], int nargin, const mxArray *in[]) |
void | gtsamNonlinearFactorGraph_deconstructor_1 (int nargout, mxArray *out[], int nargin, const mxArray *in[]) |
void | gtsamPinholeCameraCal3Bundler_collectorInsertAndMakeBase_5 (int nargout, mxArray *out[], int nargin, const mxArray *in[]) |
void | gtsamPinholeCameraCal3Bundler_deconstructor_6 (int nargout, mxArray *out[], int nargin, const mxArray *in[]) |
void | gtsamSfmTrack_collectorInsertAndMakeBase_3 (int nargout, mxArray *out[], int nargin, const mxArray *in[]) |
void | gtsamSfmTrack_deconstructor_4 (int nargout, mxArray *out[], int nargin, const mxArray *in[]) |
void | mexFunction (int nargout, mxArray *out[], int nargin, const mxArray *in[]) |
typedef std::set<boost::shared_ptr<ClassD>*> Collector_ClassD |
Definition at line 73 of file special_cases_wrapper.cpp.
typedef std::set<boost::shared_ptr<ForwardKinematicsFactor>*> Collector_ForwardKinematicsFactor |
Definition at line 61 of file special_cases_wrapper.cpp.
typedef std::set<boost::shared_ptr<FunDouble>*> Collector_FunDouble |
Definition at line 35 of file special_cases_wrapper.cpp.
typedef std::set<boost::shared_ptr<FunRange>*> Collector_FunRange |
Definition at line 33 of file special_cases_wrapper.cpp.
typedef std::set<boost::shared_ptr<GeneralSFMFactorCal3Bundler>*> Collector_gtsamGeneralSFMFactorCal3Bundler |
Definition at line 81 of file special_cases_wrapper.cpp.
typedef std::set<boost::shared_ptr<gtsam::NonlinearFactorGraph>*> Collector_gtsamNonlinearFactorGraph |
Definition at line 75 of file special_cases_wrapper.cpp.
typedef std::set<boost::shared_ptr<PinholeCameraCal3Bundler>*> Collector_gtsamPinholeCameraCal3Bundler |
Definition at line 79 of file special_cases_wrapper.cpp.
typedef std::set<boost::shared_ptr<gtsam::Point2>*> Collector_gtsamPoint2 |
Definition at line 51 of file special_cases_wrapper.cpp.
typedef std::set<boost::shared_ptr<gtsam::Point3>*> Collector_gtsamPoint3 |
Definition at line 53 of file special_cases_wrapper.cpp.
typedef std::set<boost::shared_ptr<gtsam::SfmTrack>*> Collector_gtsamSfmTrack |
Definition at line 77 of file special_cases_wrapper.cpp.
typedef std::set<boost::shared_ptr<MultipleTemplatesIntDouble>*> Collector_MultipleTemplatesIntDouble |
Definition at line 45 of file special_cases_wrapper.cpp.
typedef std::set<boost::shared_ptr<MultipleTemplatesIntFloat>*> Collector_MultipleTemplatesIntFloat |
Definition at line 47 of file special_cases_wrapper.cpp.
typedef std::set<boost::shared_ptr<MyBase>*> Collector_MyBase |
Definition at line 55 of file special_cases_wrapper.cpp.
typedef std::set<boost::shared_ptr<MyFactorPosePoint2>*> Collector_MyFactorPosePoint2 |
Definition at line 49 of file special_cases_wrapper.cpp.
typedef std::set<boost::shared_ptr<MyTemplateMatrix>*> Collector_MyTemplateMatrix |
Definition at line 59 of file special_cases_wrapper.cpp.
typedef std::set<boost::shared_ptr<MyTemplatePoint2>*> Collector_MyTemplatePoint2 |
Definition at line 57 of file special_cases_wrapper.cpp.
typedef std::set<boost::shared_ptr<MyVector12>*> Collector_MyVector12 |
Definition at line 43 of file special_cases_wrapper.cpp.
typedef std::set<boost::shared_ptr<MyVector3>*> Collector_MyVector3 |
Definition at line 41 of file special_cases_wrapper.cpp.
typedef std::set<boost::shared_ptr<ns1::ClassA>*> Collector_ns1ClassA |
Definition at line 63 of file special_cases_wrapper.cpp.
typedef std::set<boost::shared_ptr<ns1::ClassB>*> Collector_ns1ClassB |
Definition at line 65 of file special_cases_wrapper.cpp.
typedef std::set<boost::shared_ptr<ns2::ClassA>*> Collector_ns2ClassA |
Definition at line 67 of file special_cases_wrapper.cpp.
typedef std::set<boost::shared_ptr<ns2::ClassC>*> Collector_ns2ClassC |
Definition at line 71 of file special_cases_wrapper.cpp.
typedef std::set<boost::shared_ptr<ns2::ns3::ClassB>*> Collector_ns2ns3ClassB |
Definition at line 69 of file special_cases_wrapper.cpp.
typedef std::set<boost::shared_ptr<PrimitiveRefDouble>*> Collector_PrimitiveRefDouble |
Definition at line 39 of file special_cases_wrapper.cpp.
typedef std::set<boost::shared_ptr<Test>*> Collector_Test |
Definition at line 37 of file special_cases_wrapper.cpp.
typedef Fun<double> FunDouble |
Definition at line 18 of file special_cases_wrapper.cpp.
typedef gtsam::GeneralSFMFactor<gtsam::PinholeCamera<gtsam::Cal3Bundler>, gtsam::Point3> GeneralSFMFactorCal3Bundler |
Definition at line 28 of file special_cases_wrapper.cpp.
typedef MultipleTemplates<int, double> MultipleTemplatesIntDouble |
Definition at line 22 of file special_cases_wrapper.cpp.
typedef MultipleTemplates<int, float> MultipleTemplatesIntFloat |
Definition at line 23 of file special_cases_wrapper.cpp.
typedef MyFactor<gtsam::Pose2, gtsam::Matrix> MyFactorPosePoint2 |
Definition at line 24 of file special_cases_wrapper.cpp.
typedef MyTemplate<gtsam::Matrix> MyTemplateMatrix |
Definition at line 26 of file special_cases_wrapper.cpp.
typedef MyTemplate<gtsam::Point2> MyTemplatePoint2 |
Definition at line 25 of file special_cases_wrapper.cpp.
typedef MyVector<12> MyVector12 |
Definition at line 21 of file special_cases_wrapper.cpp.
typedef MyVector<3> MyVector3 |
Definition at line 20 of file special_cases_wrapper.cpp.
Definition at line 27 of file special_cases_wrapper.cpp.
typedef PrimitiveRef<double> PrimitiveRefDouble |
Definition at line 19 of file special_cases_wrapper.cpp.
void _deleteAllObjects | ( | ) |
Definition at line 84 of file special_cases_wrapper.cpp.
void _special_cases_RTTIRegister | ( | ) |
Definition at line 248 of file special_cases_wrapper.cpp.
BOOST_CLASS_EXPORT_GUID | ( | gtsam::Point2 | , |
"gtsamPoint2" | |||
) |
BOOST_CLASS_EXPORT_GUID | ( | gtsam::Point3 | , |
"gtsamPoint3" | |||
) |
void gtsamGeneralSFMFactorCal3Bundler_collectorInsertAndMakeBase_7 | ( | int | nargout, |
mxArray * | out[], | ||
int | nargin, | ||
const mxArray * | in[] | ||
) |
Definition at line 355 of file special_cases_wrapper.cpp.
void gtsamGeneralSFMFactorCal3Bundler_deconstructor_8 | ( | int | nargout, |
mxArray * | out[], | ||
int | nargin, | ||
const mxArray * | in[] | ||
) |
Definition at line 364 of file special_cases_wrapper.cpp.
void gtsamNonlinearFactorGraph_addPrior_2 | ( | int | nargout, |
mxArray * | out[], | ||
int | nargin, | ||
const mxArray * | in[] | ||
) |
Definition at line 301 of file special_cases_wrapper.cpp.
void gtsamNonlinearFactorGraph_collectorInsertAndMakeBase_0 | ( | int | nargout, |
mxArray * | out[], | ||
int | nargin, | ||
const mxArray * | in[] | ||
) |
Definition at line 279 of file special_cases_wrapper.cpp.
void gtsamNonlinearFactorGraph_deconstructor_1 | ( | int | nargout, |
mxArray * | out[], | ||
int | nargin, | ||
const mxArray * | in[] | ||
) |
Definition at line 288 of file special_cases_wrapper.cpp.
void gtsamPinholeCameraCal3Bundler_collectorInsertAndMakeBase_5 | ( | int | nargout, |
mxArray * | out[], | ||
int | nargin, | ||
const mxArray * | in[] | ||
) |
Definition at line 333 of file special_cases_wrapper.cpp.
void gtsamPinholeCameraCal3Bundler_deconstructor_6 | ( | int | nargout, |
mxArray * | out[], | ||
int | nargin, | ||
const mxArray * | in[] | ||
) |
Definition at line 342 of file special_cases_wrapper.cpp.
void gtsamSfmTrack_collectorInsertAndMakeBase_3 | ( | int | nargout, |
mxArray * | out[], | ||
int | nargin, | ||
const mxArray * | in[] | ||
) |
Definition at line 311 of file special_cases_wrapper.cpp.
void gtsamSfmTrack_deconstructor_4 | ( | int | nargout, |
mxArray * | out[], | ||
int | nargin, | ||
const mxArray * | in[] | ||
) |
Definition at line 320 of file special_cases_wrapper.cpp.
Definition at line 378 of file special_cases_wrapper.cpp.
|
static |
Definition at line 74 of file special_cases_wrapper.cpp.
|
static |
Definition at line 62 of file special_cases_wrapper.cpp.
|
static |
Definition at line 36 of file special_cases_wrapper.cpp.
|
static |
Definition at line 34 of file special_cases_wrapper.cpp.
|
static |
Definition at line 82 of file special_cases_wrapper.cpp.
|
static |
Definition at line 76 of file special_cases_wrapper.cpp.
|
static |
Definition at line 80 of file special_cases_wrapper.cpp.
|
static |
Definition at line 52 of file special_cases_wrapper.cpp.
|
static |
Definition at line 54 of file special_cases_wrapper.cpp.
|
static |
Definition at line 78 of file special_cases_wrapper.cpp.
|
static |
Definition at line 46 of file special_cases_wrapper.cpp.
|
static |
Definition at line 48 of file special_cases_wrapper.cpp.
|
static |
Definition at line 56 of file special_cases_wrapper.cpp.
|
static |
Definition at line 50 of file special_cases_wrapper.cpp.
|
static |
Definition at line 60 of file special_cases_wrapper.cpp.
|
static |
Definition at line 58 of file special_cases_wrapper.cpp.
|
static |
Definition at line 44 of file special_cases_wrapper.cpp.
|
static |
Definition at line 42 of file special_cases_wrapper.cpp.
|
static |
Definition at line 64 of file special_cases_wrapper.cpp.
|
static |
Definition at line 66 of file special_cases_wrapper.cpp.
|
static |
Definition at line 68 of file special_cases_wrapper.cpp.
|
static |
Definition at line 72 of file special_cases_wrapper.cpp.
|
static |
Definition at line 70 of file special_cases_wrapper.cpp.
|
static |
Definition at line 40 of file special_cases_wrapper.cpp.
|
static |
Definition at line 38 of file special_cases_wrapper.cpp.