#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) |
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 |
#define WRAP | ( | x | ) |
Definition at line 10 of file tf2_py.cpp.
|
static |
Definition at line 533 of file tf2_py.cpp.
|
static |
Definition at line 260 of file tf2_py.cpp.
|
static |
Definition at line 516 of file tf2_py.cpp.
|
static |
Definition at line 525 of file tf2_py.cpp.
|
static |
Definition at line 207 of file tf2_py.cpp.
|
static |
Definition at line 201 of file tf2_py.cpp.
|
static |
Definition at line 250 of file tf2_py.cpp.
|
static |
Definition at line 177 of file tf2_py.cpp.
|
static |
Definition at line 213 of file tf2_py.cpp.
|
static |
Definition at line 228 of file tf2_py.cpp.
|
inlinestatic |
Definition at line 409 of file tf2_py.cpp.
|
inlinestatic |
Definition at line 396 of file tf2_py.cpp.
|
static |
Definition at line 509 of file tf2_py.cpp.
|
static |
Definition at line 282 of file tf2_py.cpp.
ROS_HELPER_EXPORT void init_tf2 | ( | ) |
Definition at line 622 of file tf2_py.cpp.
|
static |
Definition at line 308 of file tf2_py.cpp.
|
static |
Definition at line 328 of file tf2_py.cpp.
PyObject* moduleInit | ( | PyObject * | m | ) |
Definition at line 607 of file tf2_py.cpp.
|
static |
Definition at line 164 of file tf2_py.cpp.
|
static |
Definition at line 151 of file tf2_py.cpp.
|
static |
Definition at line 423 of file tf2_py.cpp.
|
static |
Definition at line 466 of file tf2_py.cpp.
bool staticInit | ( | ) |
Definition at line 571 of file tf2_py.cpp.
|
static |
Definition at line 71 of file tf2_py.cpp.
|
static |
Definition at line 544 of file tf2_py.cpp.
|
static |
Definition at line 60 of file tf2_py.cpp.
|
static |
Definition at line 566 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.