Classes | Macros | Functions | Variables
tf2_py.cpp File Reference
#include <Python.h>
#include <tf2/buffer_core.h>
#include <tf2/exceptions.h>
#include "python_compat.h"
Include dependency graph for tf2_py.cpp:

Go to the source code of this file.

Classes

struct  buffer_core_t
 

Macros

#define WRAP(x)
 

Functions

static PyObject * _allFramesAsDot (PyObject *self, PyObject *args, PyObject *kw)
 
static PyObject * _chain (PyObject *self, PyObject *args, PyObject *kw)
 
static PyObject * _frameExists (PyObject *self, PyObject *args)
 
static PyObject * _getFrameStrings (PyObject *self, PyObject *args)
 
static PyObject * allFramesAsString (PyObject *self, PyObject *args)
 
static PyObject * allFramesAsYAML (PyObject *self, PyObject *args)
 
static PyObject * asListOfStrings (std::vector< std::string > los)
 
static int BufferCore_init (PyObject *self, PyObject *args, PyObject *kw)
 
static PyObject * canTransformCore (PyObject *self, PyObject *args, PyObject *kw)
 
static PyObject * canTransformFullCore (PyObject *self, PyObject *args, PyObject *kw)
 
static int checkRotationType (PyObject *o)
 
static int checkTranslationType (PyObject *o)
 
static PyObject * clear (PyObject *self, PyObject *args)
 
static PyObject * getLatestCommonTime (PyObject *self, PyObject *args)
 
ROS_HELPER_EXPORT void init_tf2 ()
 
static PyObject * lookupTransformCore (PyObject *self, PyObject *args, PyObject *kw)
 
static PyObject * lookupTransformFullCore (PyObject *self, PyObject *args, PyObject *kw)
 
PyObject * moduleInit (PyObject *m)
 
static int rosduration_converter (PyObject *obj, ros::Duration *rt)
 
static int rostime_converter (PyObject *obj, ros::Time *rt)
 
static PyObject * setTransform (PyObject *self, PyObject *args)
 
static PyObject * setTransformStatic (PyObject *self, PyObject *args)
 
bool staticInit ()
 
static PyObject * transform_converter (const geometry_msgs::TransformStamped *transform)
 

Variables

static struct PyMethodDef buffer_core_methods []
 
static PyTypeObject buffer_core_Type
 
static PyMethodDef module_methods []
 
static PyObject * pModulegeometrymsgs = NULL
 
static PyObject * pModulerospy = NULL
 
static PyObject * tf2_connectivityexception = NULL
 
static PyObject * tf2_exception = NULL
 
static PyObject * tf2_extrapolationexception = NULL
 
static PyObject * tf2_invalidargumentexception = NULL
 
static PyObject * tf2_lookupexception = NULL
 
static PyObject * tf2_timeoutexception = NULL
 

Macro Definition Documentation

◆ WRAP

#define WRAP (   x)

Definition at line 10 of file tf2_py.cpp.

Function Documentation

◆ _allFramesAsDot()

static PyObject* _allFramesAsDot ( PyObject *  self,
PyObject *  args,
PyObject *  kw 
)
static

Definition at line 533 of file tf2_py.cpp.

◆ _chain()

static PyObject* _chain ( PyObject *  self,
PyObject *  args,
PyObject *  kw 
)
static

Definition at line 260 of file tf2_py.cpp.

◆ _frameExists()

static PyObject* _frameExists ( PyObject *  self,
PyObject *  args 
)
static

Definition at line 516 of file tf2_py.cpp.

◆ _getFrameStrings()

static PyObject* _getFrameStrings ( PyObject *  self,
PyObject *  args 
)
static

Definition at line 525 of file tf2_py.cpp.

◆ allFramesAsString()

static PyObject* allFramesAsString ( PyObject *  self,
PyObject *  args 
)
static

Definition at line 207 of file tf2_py.cpp.

◆ allFramesAsYAML()

static PyObject* allFramesAsYAML ( PyObject *  self,
PyObject *  args 
)
static

Definition at line 201 of file tf2_py.cpp.

◆ asListOfStrings()

static PyObject* asListOfStrings ( std::vector< std::string >  los)
static

Definition at line 250 of file tf2_py.cpp.

◆ BufferCore_init()

static int BufferCore_init ( PyObject *  self,
PyObject *  args,
PyObject *  kw 
)
static

Definition at line 177 of file tf2_py.cpp.

◆ canTransformCore()

static PyObject* canTransformCore ( PyObject *  self,
PyObject *  args,
PyObject *  kw 
)
static

Definition at line 213 of file tf2_py.cpp.

◆ canTransformFullCore()

static PyObject* canTransformFullCore ( PyObject *  self,
PyObject *  args,
PyObject *  kw 
)
static

Definition at line 228 of file tf2_py.cpp.

◆ checkRotationType()

static int checkRotationType ( PyObject *  o)
inlinestatic

Definition at line 409 of file tf2_py.cpp.

◆ checkTranslationType()

static int checkTranslationType ( PyObject *  o)
inlinestatic

Definition at line 396 of file tf2_py.cpp.

◆ clear()

static PyObject* clear ( PyObject *  self,
PyObject *  args 
)
static

Definition at line 509 of file tf2_py.cpp.

◆ getLatestCommonTime()

static PyObject* getLatestCommonTime ( PyObject *  self,
PyObject *  args 
)
static

Definition at line 282 of file tf2_py.cpp.

◆ init_tf2()

ROS_HELPER_EXPORT void init_tf2 ( )

Definition at line 622 of file tf2_py.cpp.

◆ lookupTransformCore()

static PyObject* lookupTransformCore ( PyObject *  self,
PyObject *  args,
PyObject *  kw 
)
static

Definition at line 308 of file tf2_py.cpp.

◆ lookupTransformFullCore()

static PyObject* lookupTransformFullCore ( PyObject *  self,
PyObject *  args,
PyObject *  kw 
)
static

Definition at line 328 of file tf2_py.cpp.

◆ moduleInit()

PyObject* moduleInit ( PyObject *  m)

Definition at line 607 of file tf2_py.cpp.

◆ rosduration_converter()

static int rosduration_converter ( PyObject *  obj,
ros::Duration rt 
)
static

Definition at line 164 of file tf2_py.cpp.

◆ rostime_converter()

static int rostime_converter ( PyObject *  obj,
ros::Time rt 
)
static

Definition at line 151 of file tf2_py.cpp.

◆ setTransform()

static PyObject* setTransform ( PyObject *  self,
PyObject *  args 
)
static

Definition at line 423 of file tf2_py.cpp.

◆ setTransformStatic()

static PyObject* setTransformStatic ( PyObject *  self,
PyObject *  args 
)
static

Definition at line 466 of file tf2_py.cpp.

◆ staticInit()

bool staticInit ( )

Definition at line 571 of file tf2_py.cpp.

◆ transform_converter()

static PyObject* transform_converter ( const geometry_msgs::TransformStamped *  transform)
static

Definition at line 71 of file tf2_py.cpp.

Variable Documentation

◆ buffer_core_methods

struct PyMethodDef buffer_core_methods[]
static
Initial value:
=
{
{"all_frames_as_yaml", allFramesAsYAML, METH_VARARGS},
{"all_frames_as_string", allFramesAsString, METH_VARARGS},
{"set_transform", setTransform, METH_VARARGS},
{"set_transform_static", setTransformStatic, METH_VARARGS},
{"can_transform_core", (PyCFunction)canTransformCore, METH_VARARGS | METH_KEYWORDS},
{"can_transform_full_core", (PyCFunction)canTransformFullCore, METH_VARARGS | METH_KEYWORDS},
{"_chain", (PyCFunction)_chain, METH_VARARGS | METH_KEYWORDS},
{"clear", (PyCFunction)clear, METH_VARARGS | METH_KEYWORDS},
{"_frameExists", (PyCFunction)_frameExists, METH_VARARGS},
{"_getFrameStrings", (PyCFunction)_getFrameStrings, METH_VARARGS},
{"_allFramesAsDot", (PyCFunction)_allFramesAsDot, METH_VARARGS | METH_KEYWORDS},
{"get_latest_common_time", (PyCFunction)getLatestCommonTime, METH_VARARGS},
{"lookup_transform_core", (PyCFunction)lookupTransformCore, METH_VARARGS | METH_KEYWORDS},
{"lookup_transform_full_core", (PyCFunction)lookupTransformFullCore, METH_VARARGS | METH_KEYWORDS},
{NULL, NULL}
}

Definition at line 544 of file tf2_py.cpp.

◆ buffer_core_Type

PyTypeObject buffer_core_Type
static
Initial value:
= {
PyObject_HEAD_INIT(NULL)
0,
"_tf2.BufferCore",
sizeof(buffer_core_t),
}

Definition at line 60 of file tf2_py.cpp.

◆ module_methods

PyMethodDef module_methods[]
static
Initial value:
= {
{0, 0, 0},
}

Definition at line 566 of file tf2_py.cpp.

◆ pModulegeometrymsgs

PyObject* pModulegeometrymsgs = NULL
static

Definition at line 49 of file tf2_py.cpp.

◆ pModulerospy

PyObject* pModulerospy = NULL
static

Definition at line 48 of file tf2_py.cpp.

◆ tf2_connectivityexception

PyObject* tf2_connectivityexception = NULL
static

Definition at line 51 of file tf2_py.cpp.

◆ tf2_exception

PyObject* tf2_exception = NULL
static

Definition at line 50 of file tf2_py.cpp.

◆ tf2_extrapolationexception

PyObject * tf2_extrapolationexception = NULL
static

Definition at line 51 of file tf2_py.cpp.

◆ tf2_invalidargumentexception

PyObject * tf2_invalidargumentexception = NULL
static

Definition at line 52 of file tf2_py.cpp.

◆ tf2_lookupexception

PyObject * tf2_lookupexception = NULL
static

Definition at line 51 of file tf2_py.cpp.

◆ tf2_timeoutexception

PyObject * tf2_timeoutexception = NULL
static

Definition at line 52 of file tf2_py.cpp.

canTransformFullCore
static PyObject * canTransformFullCore(PyObject *self, PyObject *args, PyObject *kw)
Definition: tf2_py.cpp:228
_frameExists
static PyObject * _frameExists(PyObject *self, PyObject *args)
Definition: tf2_py.cpp:516
allFramesAsYAML
static PyObject * allFramesAsYAML(PyObject *self, PyObject *args)
Definition: tf2_py.cpp:201
_getFrameStrings
static PyObject * _getFrameStrings(PyObject *self, PyObject *args)
Definition: tf2_py.cpp:525
setTransform
static PyObject * setTransform(PyObject *self, PyObject *args)
Definition: tf2_py.cpp:423
lookupTransformFullCore
static PyObject * lookupTransformFullCore(PyObject *self, PyObject *args, PyObject *kw)
Definition: tf2_py.cpp:328
_allFramesAsDot
static PyObject * _allFramesAsDot(PyObject *self, PyObject *args, PyObject *kw)
Definition: tf2_py.cpp:533
allFramesAsString
static PyObject * allFramesAsString(PyObject *self, PyObject *args)
Definition: tf2_py.cpp:207
clear
static PyObject * clear(PyObject *self, PyObject *args)
Definition: tf2_py.cpp:509
canTransformCore
static PyObject * canTransformCore(PyObject *self, PyObject *args, PyObject *kw)
Definition: tf2_py.cpp:213
_chain
static PyObject * _chain(PyObject *self, PyObject *args, PyObject *kw)
Definition: tf2_py.cpp:260
setTransformStatic
static PyObject * setTransformStatic(PyObject *self, PyObject *args)
Definition: tf2_py.cpp:466
getLatestCommonTime
static PyObject * getLatestCommonTime(PyObject *self, PyObject *args)
Definition: tf2_py.cpp:282
lookupTransformCore
static PyObject * lookupTransformCore(PyObject *self, PyObject *args, PyObject *kw)
Definition: tf2_py.cpp:308
buffer_core_t
Definition: tf2_py.cpp:54


tf2_py
Author(s):
autogenerated on Sun Feb 4 2024 03:18:15