#include <output_recorder.h>
Public Member Functions | |
double | calculateLS (std::vector< double > *vec_out, std::vector< double > *vec_in, int model_order, double &a1, double &a2, double &a3, double &b1, double &b2, double &b3) |
void | euler (std::vector< double > *out, double in, double dt) |
void | fillDataVectors (double x_dot_lin_in, double x_dot_lin_out, double y_dot_lin_in, double y_dot_lin_out, double z_dot_lin_in, double z_dot_lin_out, double x_dot_rot_in, double x_dot_rot_out, double y_dot_rot_in, double y_dot_rot_out, double z_dot_rot_in, double z_dot_rot_out, double x_lin_out, double y_lin_out, double z_lin_out, double x_rot_out, double y_rot_out, double z_rot_out) |
geometry_msgs::Pose | getEndeffectorPose () |
bool | initialize () |
void | jointstateCallback (const sensor_msgs::JointState::ConstPtr &msg) |
void | pseudoInverse (const Eigen::MatrixXd &matrix, Eigen::MatrixXd &matrix_inv, double tolerance) |
void | quit (int sig) |
void | run () |
void | stepResponsePlot (std::string file_name, std::vector< double > *in, std::vector< double > *x_lin_out, std::vector< double > *y_lin_out, std::vector< double > *z_lin_out, std::vector< double > *x_rot_out, std::vector< double > *y_rot_out, std::vector< double > *z_rot_out) |
void | stopRecording () |
void | twistCallback (const geometry_msgs::TwistStamped::ConstPtr &msg) |
void | writeToMFile (std::string file_name, std::vector< double > *dot_in, std::vector< double > *dot_out, std::vector< double > *pos_out, std::vector< double > *dot_integrated) |
Definition at line 50 of file output_recorder.h.
double OutputRecorder::calculateLS | ( | std::vector< double > * | vec_out, |
std::vector< double > * | vec_in, | ||
int | model_order, | ||
double & | a1, | ||
double & | a2, | ||
double & | a3, | ||
double & | b1, | ||
double & | b2, | ||
double & | b3 | ||
) |
System 1. Ordnung
System 2. Ordnung
System 3. Ordnung
'double' machine precision http://freemat.sourceforge.net/help/constants_eps.html
Definition at line 344 of file output_recorder.cpp.
void OutputRecorder::euler | ( | std::vector< double > * | out, |
double | in, | ||
double | dt | ||
) |
Definition at line 485 of file output_recorder.cpp.
void OutputRecorder::fillDataVectors | ( | double | x_dot_lin_in, |
double | x_dot_lin_out, | ||
double | y_dot_lin_in, | ||
double | y_dot_lin_out, | ||
double | z_dot_lin_in, | ||
double | z_dot_lin_out, | ||
double | x_dot_rot_in, | ||
double | x_dot_rot_out, | ||
double | y_dot_rot_in, | ||
double | y_dot_rot_out, | ||
double | z_dot_rot_in, | ||
double | z_dot_rot_out, | ||
double | x_lin_out, | ||
double | y_lin_out, | ||
double | z_lin_out, | ||
double | x_rot_out, | ||
double | y_rot_out, | ||
double | z_rot_out | ||
) |
lin velocity
rot velocity
lin position
rot position
Definition at line 497 of file output_recorder.cpp.
geometry_msgs::Pose OutputRecorder::getEndeffectorPose | ( | ) |
Definition at line 317 of file output_recorder.cpp.
bool OutputRecorder::initialize | ( | ) |
parse robot_description and generate KDL chains
initialize variables and current joint values and velocities
Definition at line 32 of file output_recorder.cpp.
void OutputRecorder::jointstateCallback | ( | const sensor_msgs::JointState::ConstPtr & | msg | ) |
Definition at line 257 of file output_recorder.cpp.
void OutputRecorder::pseudoInverse | ( | const Eigen::MatrixXd & | matrix, |
Eigen::MatrixXd & | matrix_inv, | ||
double | tolerance | ||
) |
Definition at line 460 of file output_recorder.cpp.
void OutputRecorder::quit | ( | int | sig | ) |
Definition at line 251 of file output_recorder.cpp.
void OutputRecorder::run | ( | ) |
Ist Position
Sollgeschwindigkeit
Generate Octave Files
Velocity Stepresponse
Position Stepresponse
Definition at line 96 of file output_recorder.cpp.
void OutputRecorder::stepResponsePlot | ( | std::string | file_name, |
std::vector< double > * | in, | ||
std::vector< double > * | x_lin_out, | ||
std::vector< double > * | y_lin_out, | ||
std::vector< double > * | z_lin_out, | ||
std::vector< double > * | x_rot_out, | ||
std::vector< double > * | y_rot_out, | ||
std::vector< double > * | z_rot_out | ||
) |
Get the vectors and write them to .m file--------------------—
Definition at line 532 of file output_recorder.cpp.
void OutputRecorder::stopRecording | ( | ) |
Definition at line 224 of file output_recorder.cpp.
void OutputRecorder::twistCallback | ( | const geometry_msgs::TwistStamped::ConstPtr & | msg | ) |
Definition at line 305 of file output_recorder.cpp.
void OutputRecorder::writeToMFile | ( | std::string | file_name, |
std::vector< double > * | dot_in, | ||
std::vector< double > * | dot_out, | ||
std::vector< double > * | pos_out, | ||
std::vector< double > * | dot_integrated | ||
) |
Get the vectors and write them to .m file
Generate the time vector based on average sample time
Generate Velocity Models----------------————————
Errorplot to identify model order-------------------————
First order
Second order
Third order
Definition at line 606 of file output_recorder.cpp.
|
private |
For Keyboard commands.
Definition at line 125 of file output_recorder.h.
|
private |
KDL Conversion.
Definition at line 86 of file output_recorder.h.
|
private |
Definition at line 88 of file output_recorder.h.
|
private |
Definition at line 89 of file output_recorder.h.
|
private |
Definition at line 94 of file output_recorder.h.
|
private |
Euler Integration.
Definition at line 118 of file output_recorder.h.
|
private |
Definition at line 121 of file output_recorder.h.
|
private |
Definition at line 93 of file output_recorder.h.
|
private |
Definition at line 92 of file output_recorder.h.
|
private |
Definition at line 83 of file output_recorder.h.
|
private |
Definition at line 126 of file output_recorder.h.
|
private |
Definition at line 90 of file output_recorder.h.
|
private |
Definition at line 91 of file output_recorder.h.
|
private |
Transform Listener.
Definition at line 115 of file output_recorder.h.
|
private |
Definition at line 81 of file output_recorder.h.
|
private |
Definition at line 87 of file output_recorder.h.
|
private |
Definition at line 105 of file output_recorder.h.
|
private |
Definition at line 105 of file output_recorder.h.
|
private |
Definition at line 105 of file output_recorder.h.
|
private |
Definition at line 127 of file output_recorder.h.
|
private |
Definition at line 120 of file output_recorder.h.
|
private |
Definition at line 122 of file output_recorder.h.
|
private |
Definition at line 82 of file output_recorder.h.
|
private |
Definition at line 95 of file output_recorder.h.
|
private |
Definition at line 95 of file output_recorder.h.
|
private |
Definition at line 111 of file output_recorder.h.
|
private |
Inputs.
Definition at line 108 of file output_recorder.h.
|
private |
Outputs.
Definition at line 99 of file output_recorder.h.
|
private |
Definition at line 112 of file output_recorder.h.
|
private |
Definition at line 109 of file output_recorder.h.
|
private |
Definition at line 100 of file output_recorder.h.
|
private |
Definition at line 103 of file output_recorder.h.
|
private |
Definition at line 104 of file output_recorder.h.
|
private |
Definition at line 111 of file output_recorder.h.
|
private |
Definition at line 108 of file output_recorder.h.
|
private |
Definition at line 99 of file output_recorder.h.
|
private |
Definition at line 112 of file output_recorder.h.
|
private |
Definition at line 109 of file output_recorder.h.
|
private |
Definition at line 100 of file output_recorder.h.
|
private |
Definition at line 103 of file output_recorder.h.
|
private |
Definition at line 104 of file output_recorder.h.
|
private |
Definition at line 111 of file output_recorder.h.
|
private |
Definition at line 108 of file output_recorder.h.
|
private |
Definition at line 99 of file output_recorder.h.
|
private |
Definition at line 112 of file output_recorder.h.
|
private |
Definition at line 109 of file output_recorder.h.
|
private |
Definition at line 100 of file output_recorder.h.
|
private |
Definition at line 103 of file output_recorder.h.
|
private |
Definition at line 104 of file output_recorder.h.