|
30 | 30 | #include <pronto_quadruped/LegOdometerBase.hpp>
|
31 | 31 | #include <pronto_quadruped/DataLogger.hpp>
|
32 | 32 |
|
| 33 | +#include <pronto_msgs/JointStateWithAcceleration.h> |
33 | 34 | #include <pronto_msgs/QuadrupedStance.h>
|
34 | 35 | #include <pronto_msgs/QuadrupedForceTorqueSensors.h>
|
35 | 36 | #include <pronto_msgs/VelocityWithSigmaBounds.h>
|
@@ -133,6 +134,25 @@ class LegodoHandlerROS : public pronto::SensingModule<sensor_msgs::JointState>,
|
133 | 134 | RBIM &init_cov) override;
|
134 | 135 | };
|
135 | 136 |
|
| 137 | +class LegodoHandlerWithAccelerationROS : public pronto::SensingModule<pronto_msgs::JointStateWithAcceleration>, |
| 138 | + public LegodoHandlerBase |
| 139 | +{ |
| 140 | +public: |
| 141 | + LegodoHandlerWithAccelerationROS(ros::NodeHandle& nh, |
| 142 | + StanceEstimatorBase &stance_est, |
| 143 | + LegOdometerBase &legodo) : LegodoHandlerBase(nh, stance_est, legodo) {} |
| 144 | + virtual ~LegodoHandlerWithAccelerationROS() = default; |
| 145 | + |
| 146 | + Update * processMessage(const pronto_msgs::JointStateWithAcceleration *msg, StateEstimator *est) override; |
| 147 | + |
| 148 | + bool processMessageInit(const pronto_msgs::JointStateWithAcceleration* /*msg*/, |
| 149 | + const std::map<std::string, bool>& /*sensor_initialized*/, |
| 150 | + const RBIS& /*default_state*/, |
| 151 | + const RBIM& /*default_cov*/, |
| 152 | + RBIS& /*init_state*/, |
| 153 | + RBIM& /*init_cov*/) override { return true; } |
| 154 | +}; |
| 155 | + |
136 | 156 | class ForceSensorLegodoHandlerROS : public LegodoHandlerBase,
|
137 | 157 | public pronto::DualSensingModule<sensor_msgs::JointState,
|
138 | 158 | pronto_msgs::QuadrupedForceTorqueSensors>
|
|
0 commit comments