52 sweepB.
c0.
Set(53.474274
f, -50.252514
f);
53 sweepB.
a0 = 513.36676f;
54 sweepB.
c.
Set(54.595478
f, -51.083473
f);
55 sweepB.
a = 513.62781f;
115 for (
float t = 0.0
f;
t < 1.0f;
t += 0.1f)
void Set(const b2Shape *shape, int32 index)
b2Vec2 b2Mul(const b2Mat22 &A, const b2Vec2 &v)
B2_API void b2TimeOfImpact(b2TOIOutput *output, const b2TOIInput *input)
void Step(Settings &settings) override
void SetZero()
Set this vector to all zeros.
geometry_msgs::TransformStamped t
void DrawPolygon(const b2Vec2 *vertices, int32 vertexCount, const b2Color &color) override
Draw a closed polygon provided in CCW order.
b2Vec2 c
center world positions
Color for debug drawing. Each value has the range [0,1].
void SetAsBox(float hx, float hy)
B2_API int32 b2_toiMaxRootIters
b2Vec2 localCenter
local center of mass position
void Set(float x_, float y_)
Set this vector to some specified coordinates.
b2Vec2 m_vertices[b2_maxPolygonVertices]
Output parameters for b2TimeOfImpact.
int RegisterTest(const char *category, const char *name, TestCreateFcn *fcn)
#define b2_maxPolygonVertices
void DrawString(int x, int y, const char *string,...)
virtual void Step(Settings &settings)
void GetTransform(b2Transform *transform, float beta) const
B2_API int32 b2_toiMaxIters