9 #ifndef SOT_JOINT_TRAJECTORY_ENTITY_HH    10 #define SOT_JOINT_TRAJECTORY_ENTITY_HH    20 #include <dynamic-graph/entity.h>    28 #if defined(joint_trajectory_entity_EXPORTS)    29 #define SOTJOINT_TRAJECTORY_ENTITY_EXPORT __declspec(dllexport)    31 #define SOTJOINT_TRAJECTORY_ENTITY_EXPORT __declspec(dllimport)    34 #define SOTJOINT_TRAJECTORY_ENTITY_EXPORT    56   void loadFile(
const std::string &name);
    73   unsigned int &getSeqId(
unsigned int &seqid, 
const int &time);
    80   int &OneStepOfUpdate(
int &
dummy, 
const int &time);
    84   virtual void display(std::ostream &os) 
const;
   125   std::deque<sot::Trajectory>::size_type 
index_;
   155   void UpdateTrajectory(
const Trajectory &aTrajectory);
   158   void setInitTraj(
const std::string &os);
   164 #endif  // SOT_JOINT_TRAJECTORY_ENTITY_HH 
virtual void display(std::ostream &os) const
Eigen::Transform< double, 3, Eigen::Affine > SOT_CORE_EXPORT MatrixHomogeneous
sot::MatrixHomogeneous waist_
Store the waist position. 
dynamicgraph::SignalTimeDependent< dynamicgraph::Vector, int > positionSOUT
Publish pose for each evaluation of the graph. 
unsigned int seqid_
Store the current seq identifier. 
std::deque< sot::Trajectory > deque_traj_
Queue of trajectories. 
std::deque< sot::Trajectory >::size_type index_
Index on the point along the trajectory. 
dynamicgraph::SignalTimeDependent< unsigned int, int > seqIdSOUT
Publish ID of the trajectory currently realized. 
dynamicgraph::SignalTimeDependent< sot::MatrixHomogeneous, int > waistSOUT
Publish waist for each evaluation of the graph. 
dynamicgraph::Vector pose_
Store the pos;. 
virtual ~SotJointTrajectoryEntity()
dynamicgraph::SignalPtr< Trajectory, int > trajectorySIN
Read a trajectory. 
dynamicgraph::SignalTimeDependent< int, int > refresherSINTERN
This object handles trajectory of quantities and publish them as signals. 
sot::Trajectory init_traj_
Initial state of the trajectory. 
SignalTimeDependent< Dummy, int > OneStepOfUpdateS
Internal signal to trigger one step of the algorithm. 
timestamp traj_timestamp_
Keep the starting time as an identifier of the trajector. 
#define DYNAMIC_GRAPH_ENTITY_DECL()
#define SOTJOINT_TRAJECTORY_ENTITY_EXPORT
dynamicgraph::SignalTimeDependent< dynamicgraph::Vector, int > comSOUT
Publish com for each evaluation of the graph. 
dynamicgraph::Vector cop_
Store the center of pressure ZMP. 
dynamicgraph::Vector com_
Store the center of mass. 
SOTJOINT_TRAJECTORY_ENTITY_EXPORT friend std::ostream & operator<<(std::ostream &os, const SotJointTrajectoryEntity &r)
dynamicgraph::SignalTimeDependent< dynamicgraph::Vector, int > zmpSOUT
Publish zmp for each evaluation of the graph.