Classes | Namespaces | Macros | Functions | Variables
pyexotica.cpp File Reference
#include <exotica_core/exotica_core.h>
#include <exotica_core/tools/box_qp.h>
#include <exotica_core/tools/box_qp_old.h>
#include <exotica_core/tools/sparse_costs.h>
#include <exotica_core/visualization_moveit.h>
#include <pybind11/eigen.h>
#include <pybind11/pybind11.h>
#include <pybind11/stl.h>
#include <octomap/OcTree.h>
#include <ros/package.h>
#include <unsupported/Eigen/CXX11/Tensor>
#include <moveit_msgs/PlanningScene.h>
#include <moveit_msgs/PlanningSceneWorld.h>
Include dependency graph for pyexotica.cpp:

Go to the source code of this file.

Classes

struct  pybind11::detail::type_caster< Hessian >
 
struct  pybind11::detail::type_caster< Initializer >
 

Namespaces

 pybind11
 
 pybind11::detail
 

Macros

#define PY_OLDSTANDARD
 
#define ROS_MESSAGE_WRAPPER(MessageType)
 

Functions

void AddInitializers (py::module &module)
 
template<class T >
Hessian array_hessian (pybind11::array_t< T > inArray)
 
Initializer CreateInitializer (const Initializer &init)
 
PyObject * CreateStringIOObject ()
 
template<class T >
py::handle hessian_array (Hessian &inp)
 
bool IsPyString (PyObject *value_py)
 
std::pair< Initializer, InitializerLoadFromXML (std::string file_name, const std::string &solver_name="", const std::string &problem_name="", bool parsePathAsXML=false)
 
std::string PyAsStdString (PyObject *value_py)
 
 PYBIND11_MODULE (_pyexotica, module)
 
 ROS_MESSAGE_WRAPPER (moveit_msgs::PlanningScene)
 
 ROS_MESSAGE_WRAPPER (moveit_msgs::PlanningSceneWorld)
 
PyObject * StdStringAsPy (std::string value)
 

Variables

std::map< std::string, Initializerknown_initializers
 

Macro Definition Documentation

#define PY_OLDSTANDARD

Definition at line 49 of file pyexotica.cpp.

#define ROS_MESSAGE_WRAPPER (   MessageType)

Definition at line 112 of file pyexotica.cpp.

Function Documentation

void AddInitializers ( py::module &  module)

Definition at line 173 of file pyexotica.cpp.

template<class T >
Hessian array_hessian ( pybind11::array_t< T >  inArray)

Definition at line 564 of file pyexotica.cpp.

Initializer CreateInitializer ( const Initializer init)

Definition at line 161 of file pyexotica.cpp.

PyObject* CreateStringIOObject ( )

Definition at line 92 of file pyexotica.cpp.

template<class T >
py::handle hessian_array ( Hessian inp)

Definition at line 595 of file pyexotica.cpp.

bool IsPyString ( PyObject *  value_py)

Definition at line 57 of file pyexotica.cpp.

std::pair<Initializer, Initializer> LoadFromXML ( std::string  file_name,
const std::string &  solver_name = "",
const std::string &  problem_name = "",
bool  parsePathAsXML = false 
)

Definition at line 166 of file pyexotica.cpp.

std::string PyAsStdString ( PyObject *  value_py)

Definition at line 66 of file pyexotica.cpp.

PYBIND11_MODULE ( _pyexotica  ,
module   
)

Shapes

Definition at line 670 of file pyexotica.cpp.

ROS_MESSAGE_WRAPPER ( moveit_msgs::PlanningScene  )
ROS_MESSAGE_WRAPPER ( moveit_msgs::PlanningSceneWorld  )
PyObject* StdStringAsPy ( std::string  value)

Definition at line 78 of file pyexotica.cpp.

Variable Documentation

std::map<std::string, Initializer> known_initializers

Definition at line 90 of file pyexotica.cpp.



exotica_python
Author(s):
autogenerated on Sat Apr 10 2021 02:35:59