10 #ifndef ROBOT_HARDWARE_H 11 #define ROBOT_HARDWARE_H 13 #include <rtm/idl/BasicDataType.hh> 14 #include <rtm/idl/ExtendedDataTypes.hh> 15 #include "hrpsys/idl/HRPDataTypes.hh" 16 #include "hrpsys/idl/RobotHardwareService.hh" 18 #include <rtm/DataFlowComponentBase.h> 22 #include <rtm/idl/BasicDataTypeSkel.h> 23 #include <rtm/idl/ExtendedDataTypesSkel.h> 61 virtual RTC::ReturnCode_t onInitialize();
109 tm.sec = coiltm.
sec();
110 tm.nsec = coiltm.
usec() * 1000;
169 std::vector<TimedAcceleration3D>
m_acc;
173 std::vector<TimedAngularVelocity3D>
m_rate;
181 OpenHRP::RobotHardwareService::TimedRobotState2
m_rstate2;
190 std::vector<OutPort<TimedAcceleration3D> *>
m_accOut;
191 std::vector<OutPort<TimedAngularVelocity3D> *>
m_rateOut;
218 void getStatus2(OpenHRP::RobotHardwareService::RobotState2 &rstate2);
230 #endif // ROBOT_HARDWARE_H
void RobotHardwareInit(RTC::Manager *manager)
TimedDoubleSeq m_q
array of actual angles of joint with jointId
TimedDoubleSeq m_pdtau
array of PD controller torques of joint with jointId
InPort< TimedDoubleSeq > m_qRefIn
RT component that do nothing and don't have ports. This component is used to create an execution cont...
RobotHardwareService_impl m_service0
RTC::CorbaPort m_RobotHardwareServicePort
TimedDoubleSeq m_tau
array of actual torques of joint with jointId
InPort< TimedDoubleSeq > m_ddqRefIn
std::vector< TimedAcceleration3D > m_acc
vector of actual acceleration (vector length = number of acceleration sensors)
std::vector< OutPort< TimedDoubleSeq > * > m_forceOut
TimedDoubleSeq m_tauRef
array of reference torques of joint with jointId
OpenHRP::RobotHardwareService::TimedRobotState2 m_rstate2
TimedLong m_emergencySignal
TimedDoubleSeq m_ddqRef
array of reference accelerations of joint with jointId
boost::shared_ptr< robot > m_robot
std::vector< TimedAngularVelocity3D > m_rate
vector of actual angular velocity (vector length = number of rate sensors)
InPort< TimedDoubleSeq > m_tauRefIn
TimedDoubleSeq m_dqRef
array of reference velocities of joint with jointId
int gettimeofday(struct timeval *tv, struct timezone *tz)
OutPort< TimedDoubleSeq > m_dqOut
ExecutionContextHandle_t UniqueId
std::vector< OutPort< TimedAngularVelocity3D > * > m_rateOut
OutPort< OpenHRP::RobotHardwareService::TimedRobotState2 > m_rstate2Out
OutPort< TimedLong > m_emergencySignalOut
TimedDoubleSeq m_qRef
array of reference angles of joint with jointId
TimedDoubleSeq m_dq
array of actual velocities of joint with jointId
std::vector< OutPort< TimedAcceleration3D > * > m_accOut
std::vector< TimedDoubleSeq > m_force
vector of actual 6D wrench (vector length = number of F/T sensors) 6D wrench vector = 3D force + 3D m...
OutPort< TimedDoubleSeq > m_pdtauOut
OutPort< TimedDoubleSeq > m_qOut
OutPort< TimedDoubleSeq > m_ctauOut
TimedDoubleSeq m_ctau
array of commanded torques of joint with jointId
OutPort< OpenHRP::TimedLongSeqSeq > m_servoStateOut
virtual void getTimeNow(Time &tm)
OutPort< TimedDoubleSeq > m_tauOut
OpenHRP::TimedLongSeqSeq m_servoState
InPort< TimedDoubleSeq > m_dqRefIn