Main Page
Namespaces
Classes
Files
File List
include
motion_module_tutorial
motion_module_tutorial.h
Go to the documentation of this file.
1
/*******************************************************************************
2
* Copyright 2018 ROBOTIS CO., LTD.
3
*
4
* Licensed under the Apache License, Version 2.0 (the "License");
5
* you may not use this file except in compliance with the License.
6
* You may obtain a copy of the License at
7
*
8
* http://www.apache.org/licenses/LICENSE-2.0
9
*
10
* Unless required by applicable law or agreed to in writing, software
11
* distributed under the License is distributed on an "AS IS" BASIS,
12
* WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied.
13
* See the License for the specific language governing permissions and
14
* limitations under the License.
15
*******************************************************************************/
16
17
#ifndef MOTION_MODULE_TUTORIAL_MOTION_MODULE_TUTORIAL_H_
18
#define MOTION_MODULE_TUTORIAL_MOTION_MODULE_TUTORIAL_H_
19
20
#include <
ros/ros.h
>
21
#include <
ros/callback_queue.h
>
22
#include <std_msgs/Int16.h>
23
#include <boost/thread.hpp>
24
25
#include "
robotis_framework_common/motion_module.h
"
26
27
namespace
thormang3
28
{
29
30
class
MotionModuleTutorial
31
:
public
robotis_framework::MotionModule
,
32
public
robotis_framework::Singleton
<MotionModuleTutorial>
33
{
34
private
:
35
int
control_cycle_msec_
;
36
boost::thread
queue_thread_
;
37
38
/* sample subscriber & publisher */
39
ros::Subscriber
sub1_
;
40
ros::Publisher
pub1_
;
41
42
void
queueThread
();
43
44
public
:
45
MotionModuleTutorial
();
46
virtual
~MotionModuleTutorial
();
47
48
/* ROS Topic Callback Functions */
49
void
topicCallback
(
const
std_msgs::Int16::ConstPtr &msg);
50
51
void
initialize
(
const
int
control_cycle_msec,
robotis_framework::Robot
*robot);
52
void
process
(std::map<std::string, robotis_framework::Dynamixel *> dxls, std::map<std::string, double> sensors);
53
54
void
stop
();
55
bool
isRunning
();
56
};
57
58
}
59
60
#endif
/* MOTION_MODULE_TUTORIAL_MOTION_MODULE_TUTORIAL_H_ */
thormang3::MotionModuleTutorial::sub1_
ros::Subscriber sub1_
Definition:
motion_module_tutorial.h:39
robotis_framework::Robot
thormang3::MotionModuleTutorial
Definition:
motion_module_tutorial.h:30
robotis_framework::MotionModule
thormang3::MotionModuleTutorial::MotionModuleTutorial
MotionModuleTutorial()
Definition:
motion_module_tutorial.cpp:22
thormang3::MotionModuleTutorial::control_cycle_msec_
int control_cycle_msec_
Definition:
motion_module_tutorial.h:35
thormang3::MotionModuleTutorial::isRunning
bool isRunning()
Definition:
motion_module_tutorial.cpp:95
thormang3::MotionModuleTutorial::process
void process(std::map< std::string, robotis_framework::Dynamixel * > dxls, std::map< std::string, double > sensors)
Definition:
motion_module_tutorial.cpp:70
thormang3
Definition:
motion_module_tutorial.h:27
motion_module.h
thormang3::MotionModuleTutorial::queueThread
void queueThread()
Definition:
motion_module_tutorial.cpp:45
ros::Subscriber
thormang3::MotionModuleTutorial::~MotionModuleTutorial
virtual ~MotionModuleTutorial()
Definition:
motion_module_tutorial.cpp:34
ros.h
thormang3::MotionModuleTutorial::topicCallback
void topicCallback(const std_msgs::Int16::ConstPtr &msg)
Definition:
motion_module_tutorial.cpp:63
thormang3::MotionModuleTutorial::stop
void stop()
Definition:
motion_module_tutorial.cpp:90
robotis_framework::Singleton
ros::Publisher
thormang3::MotionModuleTutorial::initialize
void initialize(const int control_cycle_msec, robotis_framework::Robot *robot)
Definition:
motion_module_tutorial.cpp:39
callback_queue.h
thormang3::MotionModuleTutorial::queue_thread_
boost::thread queue_thread_
Definition:
motion_module_tutorial.h:36
thormang3::MotionModuleTutorial::pub1_
ros::Publisher pub1_
Definition:
motion_module_tutorial.h:40
motion_module_tutorial
Author(s): Zerom
, SCH
, Kayman
autogenerated on Mon Jun 10 2019 15:37:41