Classes | Namespaces | Typedefs | Enumerations | Functions
recordGen.cpp File Reference
#include <ros/ros.h>
#include <dynamic_reconfigure/server.h>
#include <std_msgs/Float64MultiArray.h>
#include <std_msgs/Empty.h>
#include <std_msgs/UInt32.h>
#include <std_msgs/UInt32MultiArray.h>
#include <std_msgs/String.h>
#include <visualization_msgs/Marker.h>
#include <visualization_msgs/MarkerArray.h>
#include <ISM/common_type/Point.hpp>
#include <ISM/common_type/Track.hpp>
#include <ISM/common_type/Tracks.hpp>
#include <ISM/common_type/Object.hpp>
#include "ISM/recognizer/VotingSpace.hpp"
#include "ISM/recorder/Recorder.hpp"
#include <ISM/utility/TableHelper.hpp>
#include <ISM/utility/MathHelper.hpp>
#include <asr_ism/recordGenConfig.h>
#include <asr_ism_visualizations/ObjectModelVisualizerRVIZ.hpp>
#include "asr_ism_visualizations/VizHelperRVIZ.hpp"
#include <boost/filesystem/path.hpp>
#include <boost/property_tree/ptree.hpp>
#include <boost/property_tree/xml_parser.hpp>
#include <boost/algorithm/string.hpp>
#include <eigen3/unsupported/Eigen/Splines>
#include <Eigen/Geometry>
#include <boost/math/constants/constants.hpp>
#include <boost/lexical_cast.hpp>
#include <boost/random.hpp>
#include <boost/random/variate_generator.hpp>
#include <boost/random/uniform_real.hpp>
#include <random>
#include <iostream>
#include <fstream>
#include <sstream>
#include <math.h>
#include <stdint.h>
#include <tuple>
Include dependency graph for recordGen.cpp:

Go to the source code of this file.

Classes

struct  cmpFromToPointTuple
 
class  FixRecordGenPoint
 
class  MidSplinePoint
 
class  MidSplinePointAlt
 
class  RecordGenerator
 
class  RecordGenPoint
 

Namespaces

 H
 

Typedefs

typedef std::tuple< uint32_t, uint32_t, RecordGenPointPtrFromToPointTuple
 
typedef boost::shared_ptr< RecordGenPointRecordGenPointPtr
 

Enumerations

enum  OrientCalcType { OrientCalcType::Fix = 0, OrientCalcType::Random = 1, OrientCalcType::Linear = 2, OrientCalcType::Undefined = 3 }
 
enum  RecGenPointType { RecGenPointType::Fix = 0, RecGenPointType::MidSpline = 1, RecGenPointType::MidSplineAlt = 2, RecGenPointType::Undefined = 3 }
 

Functions

template<class C , class T >
auto H::contains (const C &v, const T &x) -> decltype(end(v), true)
 
double frand (double min, double max)
 
std_msgs::ColorRGBA getColorForTypeId (std::map< std::pair< std::string, std::string >, std_msgs::ColorRGBA > &typeIdToColor, std::vector< std_msgs::ColorRGBA > &allColors, uint32_t &availColorIndex, std::string &type, std::string &id)
 
int main (int argc, char **argv)
 
OrientCalcType orientCalcTypeFromString (const std::string &s)
 
RecGenPointType recGenPointTypeFromString (const std::string &s)
 

Typedef Documentation

typedef std::tuple<uint32_t,uint32_t,RecordGenPointPtr> FromToPointTuple

Definition at line 589 of file recordGen.cpp.

Definition at line 588 of file recordGen.cpp.

Enumeration Type Documentation

enum OrientCalcType
strong
Enumerator
Fix 
Random 
Linear 
Undefined 

Definition at line 111 of file recordGen.cpp.

enum RecGenPointType
strong
Enumerator
Fix 
MidSpline 
MidSplineAlt 
Undefined 

Definition at line 77 of file recordGen.cpp.

Function Documentation

double frand ( double  min,
double  max 
)

Definition at line 72 of file recordGen.cpp.

std_msgs::ColorRGBA getColorForTypeId ( std::map< std::pair< std::string, std::string >, std_msgs::ColorRGBA > &  typeIdToColor,
std::vector< std_msgs::ColorRGBA > &  allColors,
uint32_t &  availColorIndex,
std::string &  type,
std::string &  id 
)

Definition at line 1042 of file recordGen.cpp.

int main ( int  argc,
char **  argv 
)

deleted for visualization refectoring. Bins now drawn at ism_voting_visualizer

Definition at line 1068 of file recordGen.cpp.

OrientCalcType orientCalcTypeFromString ( const std::string &  s)

Definition at line 119 of file recordGen.cpp.

RecGenPointType recGenPointTypeFromString ( const std::string &  s)

Definition at line 95 of file recordGen.cpp.



asr_ism
Author(s): Borella Jocelyn, Hanselmann Fabian, Heller Florian, Heizmann Heinrich, Kübler Marcel, Mehlhaus Jonas, Meißner Pascal, Qattan Mohamad, Reckling Reno, Stroh Daniel
autogenerated on Thu Jan 9 2020 07:20:58