|
void | computeAABB (hrp::Vector3 &o_min, hrp::Vector3 &o_max) |
|
void | divideLargeTriangles (double maxEdgeLen) |
|
size_t | draw () |
|
void | draw () |
|
void | drawSensor (hrp::Sensor *i_sensor) |
|
GLcamera * | findCamera (const char *i_name) |
|
GLcamera * | findCamera (const char *i_name) |
|
GLcamera * | findCamera (const char *i_name) |
|
virtual const irr::core::aabbox3d< irr::f32 > & | getBoundingBox () const |
|
boost::function2< void, hrp::Body *, hrp::Sensor * > | getSensorDrawCallback () |
|
| GLbody () |
|
| GLbody (irr::scene::ISceneNode *i_parent, irr::scene::ISceneManager *i_mgr, irr::s32 i_id, OpenHRP::BodyInfo_var i_binfo) |
|
| GLbody (OpenHRP::BodyInfo_var i_binfo) |
|
virtual void | render () |
|
void | setPosition (double x, double y, double z) |
|
template<class T > |
void | setPosition (const T &p) |
|
void | setPosture (const double *i_angles) |
|
void | setPosture (const double *i_angles, double *i_pos, double *i_rpy) |
|
void | setPosture (const hrp::dvector &i_q, const hrp::Vector3 &i_p, const hrp::Matrix33 &i_R) |
|
void | setPosture (double *i_angles, double *i_pos, double *i_rpy) |
|
void | setPosture (double *i_angles, double *i_pos, double *i_rpy) |
|
void | setRotation (const double *R) |
|
void | setRotation (double r, double p, double y) |
|
void | setSensorDrawCallback (boost::function2< void, hrp::Body *, hrp::Sensor * > f) |
|
| ~GLbody () |
|
| ~GLbody () |
|
Public Member Functions inherited from hrp::Body |
void | addSensor (Sensor *sensor, int sensorType, int id) |
|
| Body () |
|
| Body (const Body &org) |
|
void | calcAngularMomentumJacobian (Link *base, dmatrix &H) |
|
Vector3 | calcCM () |
|
void | calcCMJacobian (Link *base, dmatrix &J) |
|
void | calcForwardKinematics (bool calcVelocity=false, bool calcAcceleration=false) |
|
void | calcInverseDynamics (Link *link, Vector3 &out_f, Vector3 &out_tau) |
|
void | calcMassMatrix (dmatrix &out_M) |
|
double | calcTotalMass () |
|
void | calcTotalMomentum (Vector3 &out_P, Vector3 &out_L) |
|
void | calcTotalMomentumFromJacobian (Vector3 &out_P, Vector3 &out_L) |
|
void | clearExternalForces () |
|
void | clearSensorValues () |
|
Light * | createLight (Link *link, int lightType, const std::string &name) |
|
Sensor * | createSensor (Link *link, int sensorType, int id, const std::string &name) |
|
void | getDefaultRootPosition (Vector3 &out_p, Matrix33 &out_R) |
|
JointPathPtr | getJointPath (Link *baseLink, Link *targetLink) |
|
void | initializeConfiguration () |
|
bool | installCustomizer () |
|
bool | installCustomizer (BodyCustomizerInterface *customizerInterface) |
|
bool | isStaticModel () |
|
Link * | joint (int id) const |
|
const std::vector< Link * > & | joints () const |
|
Light * | light (const std::string &name) |
|
Link * | link (int index) const |
|
Link * | link (const std::string &name) const |
|
const LinkTraverse & | links () const |
|
const LinkTraverse & | linkTraverse () const |
|
const std::string & | modelName () |
|
const std::string & | name () |
|
unsigned int | numJoints () const |
|
unsigned int | numLinks () const |
|
unsigned int | numSensors (int sensorType) const |
|
unsigned int | numSensorTypes () const |
|
void | putInformation (std::ostream &out) |
|
Link * | rootLink () const |
|
Sensor * | sensor (int sensorType, int sensorId) const |
|
TSensor * | sensor (const std::string &name) const |
|
TSensor * | sensor (int id) const |
|
void | setColumnOfMassMatrix (dmatrix &M, int column) |
|
void | setDefaultRootPosition (const Vector3 &p, const Matrix33 &R) |
|
void | setModelName (const std::string &name) |
|
void | setName (const std::string &name) |
|
void | setRootLink (Link *link) |
|
void | setVirtualJointForces () |
|
double | totalMass () const |
|
void | updateLinkColdetModelPositions () |
|
void | updateLinkTree () |
|
virtual | ~Body () |
|
| Referenced () |
|
virtual | ~Referenced () |
|
Definition at line 11 of file GLbody.h.