33 #include <std_msgs/Int32.h> 34 #include <std_msgs/Float32.h> 35 #include <std_msgs/Float64.h> 36 #include <std_msgs/String.h> 37 #include <std_msgs/Bool.h> 38 #include <std_msgs/Float32MultiArray.h> 39 #include <std_msgs/Float64MultiArray.h> 43 #include "denso_robot_core/Joints.h" 44 #include "denso_robot_core/ExJoints.h" 45 #include "denso_robot_core/PoseData.h" 46 #include "denso_robot_core/UserIO.h" 53 #include "denso_robot_core/MoveStringAction.h" 54 #include "denso_robot_core/MoveValueAction.h" 55 #include "denso_robot_core/DriveStringAction.h" 56 #include "denso_robot_core/DriveValueAction.h" 61 #define MESSAGE_QUEUE (1) 62 #define BCAP_VAR_DEFAULT_DURATION (1000) 73 static constexpr
int BCAP_GET_OBJECT_ARGS = 3;
74 static constexpr
int BCAP_GET_OBJECTNAMES_ARGS = 2;
84 static std::string ConvertBSTRToString(
const BSTR bstr);
85 static BSTR ConvertStringToBSTR(
const std::string& str);
88 DensoBase(
const std::string& name,
const int* mode) : m_parent(NULL), m_name(name), m_mode(mode), m_serving(false)
92 DensoBase(
DensoBase* parent, Service_Vec& service, Handle_Vec& handle,
const std::string& name,
const int* mode)
93 : m_parent(parent), m_name(name), m_mode(mode), m_serving(false)
95 m_vecService = service;
126 const std::string&
Name()
const 131 std::string RosName()
const;
136 bool bRead =
false,
bool bWrite =
false,
bool bID =
false,
142 HRESULT AddObject(
int32_t get_id,
const std::string& name, Handle_Vec& vecHandle);
170 #endif // DENSO_BASE_H
virtual HRESULT InitializeBCAP()
std::vector< uint32_t > Handle_Vec
virtual HRESULT TerminateBCAP()
std::vector< BCAPService_Ptr > Service_Vec
std::vector< std::string > Name_Vec
boost::shared_ptr< DensoBase > DensoBase_Ptr
std::vector< DensoBase_Ptr > DensoBase_Vec
const std::string & Name() const
DensoBase(const std::string &name, const int *mode)
virtual HRESULT StopService()
#define BCAP_VAR_DEFAULT_DURATION
DensoBase(DensoBase *parent, Service_Vec &service, Handle_Vec &handle, const std::string &name, const int *mode)