Typedefs | Functions
main.cpp File Reference
#include <chrono>
#include <iostream>
#include <math.h>
#include <mutex>
#include <regex>
#include <string>
#include <thread>
#include <vector>
#include <boost/filesystem/fstream.hpp>
#include "lvr2/geometry/BaseVector.hpp"
#include "lvr2/io/ModelFactory.hpp"
#include "lvr2/io/RxpIO.hpp"
#include "lvr2/util/Util.hpp"
#include "lvr2/types/MatrixTypes.hpp"
#include "lvr2/registration/TransformUtils.hpp"
#include "Options.hpp"
#include "RieglProject.hpp"
Include dependency graph for main.cpp:

Go to the source code of this file.

Typedefs

using Vec = lvr2::BaseVector< float >
 

Functions

int char_to_int (char in)
 
bool convert_riegl_project (lvr2::RieglProject &ri_proj, const fs::path &out_scan_dir, bool force_overwrite, unsigned int reduction, std::string output_coords="slam6d")
 
void convert_rxp_to_3d_per_thread (std::vector< lvr2::ScanPosition > *work, int *read_file_count, int *current_file_idx, const fs::path *scans_dir, std::mutex *mtx, int id, bool force_overwrite, unsigned int reduction, std::string inputformat="rxp", std::string outputcoords="slam6d")
 
bool copy_file (const fs::path from, const fs::path to, bool force_overwrite)
 
int main (int argc, char **argv)
 
void transformModel (lvr2::ModelPtr model, const lvr2::Transformd &transform)
 
template<typename T >
bool write_mat4_to_file (lvr2::Transformd mat, fs::path dest, bool force_overwrite)
 
bool write_mat4_to_pose_file (const fs::path file, const lvr2::Transformd &transform, bool force_overwrite)
 
template<typename ValueType >
bool write_params_to_file (fs::path dest, bool force_overwrite, ValueType *values, int count)
 

Typedef Documentation

◆ Vec

using Vec = lvr2::BaseVector<float>

Copyright (c) 2018, University Osnabrück All rights reserved.

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

  • Redistributions of source code must retain the above copyright notice, this list of conditions and the following disclaimer.
  • 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.
  • Neither the name of the University Osnabrück 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 University Osnabrück 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.

Definition at line 58 of file main.cpp.

Function Documentation

◆ char_to_int()

int char_to_int ( char  in)

Definition at line 101 of file main.cpp.

◆ convert_riegl_project()

bool convert_riegl_project ( lvr2::RieglProject ri_proj,
const fs::path &  out_scan_dir,
bool  force_overwrite,
unsigned int  reduction,
std::string  output_coords = "slam6d" 
)

Definition at line 284 of file main.cpp.

◆ convert_rxp_to_3d_per_thread()

void convert_rxp_to_3d_per_thread ( std::vector< lvr2::ScanPosition > *  work,
int *  read_file_count,
int *  current_file_idx,
const fs::path *  scans_dir,
std::mutex *  mtx,
int  id,
bool  force_overwrite,
unsigned int  reduction,
std::string  inputformat = "rxp",
std::string  outputcoords = "slam6d" 
)

Definition at line 190 of file main.cpp.

◆ copy_file()

bool copy_file ( const fs::path  from,
const fs::path  to,
bool  force_overwrite 
)

Definition at line 130 of file main.cpp.

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 425 of file main.cpp.

◆ transformModel()

void transformModel ( lvr2::ModelPtr  model,
const lvr2::Transformd transform 
)

Definition at line 60 of file main.cpp.

◆ write_mat4_to_file()

template<typename T >
bool write_mat4_to_file ( lvr2::Transformd  mat,
fs::path  dest,
bool  force_overwrite 
)

Definition at line 106 of file main.cpp.

◆ write_mat4_to_pose_file()

bool write_mat4_to_pose_file ( const fs::path  file,
const lvr2::Transformd transform,
bool  force_overwrite 
)

Definition at line 149 of file main.cpp.

◆ write_params_to_file()

template<typename ValueType >
bool write_params_to_file ( fs::path  dest,
bool  force_overwrite,
ValueType *  values,
int  count 
)

Definition at line 77 of file main.cpp.



lvr2
Author(s): Thomas Wiemann , Sebastian Pütz , Alexander Mock , Lars Kiesow , Lukas Kalbertodt , Tristan Igelbrink , Johan M. von Behren , Dominik Feldschnieders , Alexander Löhr
autogenerated on Wed Mar 2 2022 00:37:25