#include <structs.h>
Public Member Functions | |
KinematicParams () | |
void | LoadParams (ros::NodeHandle &nh_local, bool show=true) |
Public Attributes | |
int | eval_every |
double | eval_every_power |
articulation_models::MultiModelFactory | factory |
std::string | full_eval |
bool | reduce_dofs |
bool | restrict_graphs |
std::string | restricted_graphs |
bool | reuse_model |
bool | search_all_models |
double | sigma_orientation |
double | sigma_position |
double | sigmax_orientation |
double | sigmax_position |
bool | supress_similar |
Definition at line 21 of file structs.cpp.
void KinematicParams::LoadParams | ( | ros::NodeHandle & | nh_local, |
bool | show = true |
||
) |
Definition at line 35 of file structs.cpp.
std::string KinematicParams::full_eval |
std::string KinematicParams::restricted_graphs |