This is the complete list of members for Chain, including all inherited members.
_apply_scale(Joint *jnt, double scale) | Chain | protected |
add_scale_object(const scale_object &_s) | Chain | |
AddJoint(Joint *target, Joint *p) | Chain | |
AddJoint(Joint *target, const char *parent_name, const char *charname=0) | Chain | |
AddJoint(JointData *joint_data, const char *charname=0) | Chain | |
AddRoot(const char *name=0, const fVec3 &grav=fVec3(0.0, 0.0, 9.8)) | Chain | |
AddRoot(Joint *r) | Chain | |
all_value | Chain | protected |
all_value_dot | Chain | protected |
all_vel | Chain | protected |
all_vel_dot | Chain | protected |
apply_geom_scale(SceneGraph *sg, Joint *cur) | Chain | protected |
apply_scale() | Chain | protectedvirtual |
apply_scale(const scale_object &_s) | Chain | protected |
apply_scale_sub(Joint *cur, double scale) | Chain | protected |
apply_scale_top(Joint *top, double scale) | Chain | protected |
ApplyGeomScale(SceneGraph *sg) | Chain | |
BeginCreateChain(int append=false) | Chain | |
calc_abs_positions(Joint *cur, SceneGraph *sg) | Chain | protected |
calc_rel_positions(Joint *cur, SceneGraph *sg) | Chain | protected |
CalcAcceleration() | Chain | |
CalcPosition() | Chain | |
CalcVelocity() | Chain | |
Chain() | Chain | |
Clear() | Chain | virtual |
clear_data() | Chain | protectedvirtual |
clear_scale_object_list() | Chain | |
ClearExtForce() | Chain | |
ClearJointForce() | Chain | |
ComJacobian(fMat &J, fVec3 &com, const char *chname=0) | Chain | |
Connect(Joint *virtual_joint, Joint *parent_joint) | Chain | |
CreateParallel(int num_char, const char *prmname, const char *charname, const fVec3 &init_pos=0.0, const fMat33 &init_att=1.0, const fVec3 &pos_offset=0.0, const fMat33 &att_offset=1.0, int init_num=0) | Chain | |
CreateSerial(int num_joint, const JointData &joint_data, const char *charname=0, Joint *parent_joint=0) | Chain | |
Disconnect(Joint *j) | Chain | |
do_connect | Chain | protected |
EndCreateChain(SceneGraph *sg=NULL) | Chain | |
FindCharacterRoot(const char *charname) | Chain | |
FindJoint(const char *jname, const char *charname=0) | Chain | |
FindJoint(int _id) | Chain | |
GetJointAcc(fVec &accs) | Chain | |
GetJointForce(fVec &forces) | Chain | |
GetJointList(Joint **&joints) | Chain | |
GetJointNameList(char **&jnames) | Chain | |
GetJointValue(fVec &values) | Chain | |
GetJointVel(fVec &vels) | Chain | |
in_create_chain | Chain | protected |
init(SceneGraph *sg) | Chain | protectedvirtual |
init_scale(SceneGraph *sg) | Chain | protected |
init_scale_sub(Node *node) | Chain | protected |
init_value | Chain | protected |
init_vel | Chain | protected |
Integrate(double timestep) | Chain | |
IntegrateAdaptive(double ×tep, int step, double min_timestep=DEFAULT_MIN_TIMESTEP, double max_integ_error=DEFAULT_MAX_INTEG_ERROR) | Chain | |
IntegrateRK4(double timestep, int step) | Chain | |
IntegrateRK4Value(double timestep, int step) | Chain | |
IntegrateRK4Velocity(double timestep, int step) | Chain | |
IntegrateValue(double timestep) | Chain | |
IntegrateVelocity(double timestep) | Chain | |
InvDyn(fVec &tau) | Chain | |
j_acc_p | Chain | protected |
j_value_dot | Chain | protected |
Joint class | Chain | friend |
Load(const char *fname, const char *charname=0) | Chain | |
LoadXML(const char *fname, const char *charname=0) | Chain | |
n_dof | Chain | protected |
n_joint | Chain | protected |
n_thrust | Chain | protected |
n_value | Chain | protected |
NumDOF() | Chain | inline |
NumJoint() | Chain | inline |
NumValue() | Chain | inline |
RemoveJoint(Joint *j) | Chain | |
reset_scale() | Chain | protected |
reset_scale_sub(Joint *jnt) | Chain | protected |
Root() | Chain | inline |
root | Chain | protected |
Save(const char *fname, const char *charname=0) const | Chain | |
Save(ostream &ost, const char *charname=0) const | Chain | |
SaveStatus(fVec &value, fVec &vel, fVec &acc) | Chain | |
SaveXML(const char *fname, const char *charname=0) const | Chain | |
SaveXML(ostream &ost, const char *charname=0) const | Chain | |
scale_object_list | Chain | protected |
set_abs_position_orientation(Joint *jnt, const fVec3 &abs_pos, const fMat33 &abs_att) | Chain | |
set_all_torque_given(Joint *cur, int _tg) | Chain | protected |
set_relative_positions(SceneGraph *sg) | Chain | protected |
SetAllTorqueGiven(int _tg) | Chain | |
SetCharacterTorqueGiven(const char *charname, int _tg) | Chain | |
SetJointAcc(const fVec &accs) | Chain | |
SetJointForce(const fVec &forces) | Chain | |
SetJointValue(const fVec &values) | Chain | |
SetJointVel(const fVec &vels) | Chain | |
SetStatus(const fVec &value, const fVec &vel, const fVec &acc) | Chain | |
SetTorqueGiven(Joint *_joint, int _tg) | Chain | |
TotalCOM(fVec3 &com, const char *chname=0) | Chain | |
~Chain() | Chain | virtual |