#include <Python.h>
#include <tf2/buffer_core.h>
#include <tf2/exceptions.h>
#include "python_compat.h"
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) |
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 |
#define WRAP | ( | x | ) |
Definition at line 10 of file tf2_py.cpp.
|
static |
Definition at line 532 of file tf2_py.cpp.
|
static |
Definition at line 259 of file tf2_py.cpp.
|
static |
Definition at line 515 of file tf2_py.cpp.
|
static |
Definition at line 524 of file tf2_py.cpp.
|
static |
Definition at line 206 of file tf2_py.cpp.
|
static |
Definition at line 200 of file tf2_py.cpp.
|
static |
Definition at line 249 of file tf2_py.cpp.
|
static |
Definition at line 176 of file tf2_py.cpp.
|
static |
Definition at line 212 of file tf2_py.cpp.
|
static |
Definition at line 227 of file tf2_py.cpp.
|
inlinestatic |
Definition at line 408 of file tf2_py.cpp.
|
inlinestatic |
Definition at line 395 of file tf2_py.cpp.
|
static |
Definition at line 508 of file tf2_py.cpp.
|
static |
Definition at line 281 of file tf2_py.cpp.
void init_tf2 | ( | ) |
Definition at line 619 of file tf2_py.cpp.
|
static |
Definition at line 307 of file tf2_py.cpp.
|
static |
Definition at line 327 of file tf2_py.cpp.
PyObject* moduleInit | ( | PyObject * | m | ) |
Definition at line 606 of file tf2_py.cpp.
|
static |
Definition at line 163 of file tf2_py.cpp.
|
static |
Definition at line 150 of file tf2_py.cpp.
|
static |
Definition at line 422 of file tf2_py.cpp.
|
static |
Definition at line 465 of file tf2_py.cpp.
bool staticInit | ( | ) |
Definition at line 570 of file tf2_py.cpp.
|
static |
Definition at line 71 of file tf2_py.cpp.
|
static |
Definition at line 543 of file tf2_py.cpp.
|
static |
Definition at line 60 of file tf2_py.cpp.
|
static |
Definition at line 565 of file tf2_py.cpp.
|
static |
Definition at line 49 of file tf2_py.cpp.
|
static |
Definition at line 48 of file tf2_py.cpp.
|
static |
Definition at line 51 of file tf2_py.cpp.
|
static |
Definition at line 50 of file tf2_py.cpp.
|
static |
Definition at line 51 of file tf2_py.cpp.
|
static |
Definition at line 52 of file tf2_py.cpp.
|
static |
Definition at line 51 of file tf2_py.cpp.
|
static |
Definition at line 52 of file tf2_py.cpp.