├── ros_face_msgs
└── msg
│ ├── Ch.msg
│ └── FaceCmd.msg
├── .gitignore
├── ros_face_Arduino
├── .gitignore
├── lib
│ └── ros_lib
│ │ ├── examples
│ │ ├── ServiceClient
│ │ │ ├── client.py
│ │ │ └── ServiceClient.pde
│ │ ├── HelloWorld
│ │ │ └── HelloWorld.pde
│ │ ├── Blink
│ │ │ └── Blink.pde
│ │ ├── pubsub
│ │ │ └── pubsub.pde
│ │ ├── TimeTF
│ │ │ └── TimeTF.pde
│ │ ├── ServiceServer
│ │ │ └── ServiceServer.pde
│ │ ├── Logging
│ │ │ └── Logging.pde
│ │ ├── Odom
│ │ │ └── Odom.pde
│ │ ├── ServoControl
│ │ │ └── ServoControl.pde
│ │ ├── ADC
│ │ │ └── ADC.pde
│ │ ├── TcpBlink
│ │ │ └── TcpBlink.ino
│ │ ├── button_example
│ │ │ └── button_example.pde
│ │ ├── Ultrasound
│ │ │ └── Ultrasound.pde
│ │ └── IrRanger
│ │ │ └── IrRanger.pde
│ │ ├── tests
│ │ ├── time_test
│ │ │ └── time_test.pde
│ │ ├── float64_test
│ │ │ └── float64_test.pde
│ │ └── array_test
│ │ │ └── array_test.pde
│ │ ├── std_msgs
│ │ ├── Empty.h
│ │ ├── Float64.h
│ │ ├── Char.h
│ │ ├── UInt8.h
│ │ ├── UInt16.h
│ │ ├── Bool.h
│ │ ├── Byte.h
│ │ ├── Int8.h
│ │ ├── String.h
│ │ ├── UInt32.h
│ │ └── Int16.h
│ │ ├── nav_msgs
│ │ ├── GetMapGoal.h
│ │ ├── GetMapFeedback.h
│ │ ├── GetMapResult.h
│ │ ├── GetMapActionGoal.h
│ │ ├── GetMapActionResult.h
│ │ └── GetMapActionFeedback.h
│ │ ├── actionlib
│ │ ├── TwoIntsFeedback.h
│ │ ├── TestRequestFeedback.h
│ │ ├── TestActionGoal.h
│ │ ├── TwoIntsActionGoal.h
│ │ ├── TestActionResult.h
│ │ ├── TestRequestActionGoal.h
│ │ ├── TwoIntsActionResult.h
│ │ ├── TestActionFeedback.h
│ │ ├── TestRequestActionResult.h
│ │ └── TwoIntsActionFeedback.h
│ │ ├── control_msgs
│ │ ├── PointHeadResult.h
│ │ ├── JointTrajectoryResult.h
│ │ ├── JointTrajectoryFeedback.h
│ │ ├── SingleJointPositionResult.h
│ │ ├── GripperCommandGoal.h
│ │ ├── PointHeadFeedback.h
│ │ ├── JointTrajectoryGoal.h
│ │ ├── GripperCommand.h
│ │ └── PointHeadActionGoal.h
│ │ ├── move_base_msgs
│ │ ├── MoveBaseResult.h
│ │ ├── MoveBaseGoal.h
│ │ ├── MoveBaseFeedback.h
│ │ └── MoveBaseActionGoal.h
│ │ ├── turtle_actionlib
│ │ ├── ShapeFeedback.h
│ │ └── ShapeActionGoal.h
│ │ ├── tf2_msgs
│ │ ├── LookupTransformFeedback.h
│ │ ├── LookupTransformResult.h
│ │ └── LookupTransformActionGoal.h
│ │ ├── jsk_footstep_msgs
│ │ ├── ExecFootstepsResult.h
│ │ ├── ExecFootstepsFeedback.h
│ │ ├── PlanFootstepsResult.h
│ │ ├── PlanFootstepsFeedback.h
│ │ └── ExecFootstepsGoal.h
│ │ ├── object_recognition_msgs
│ │ ├── ObjectRecognitionFeedback.h
│ │ └── ObjectRecognitionResult.h
│ │ ├── dynamic_reconfigure
│ │ └── SensorLevels.h
│ │ ├── jsk_gui_msgs
│ │ ├── Gravity.h
│ │ └── MagneticField.h
│ │ ├── shape_msgs
│ │ └── Plane.h
│ │ ├── bond
│ │ └── Constants.h
│ │ ├── turtlebot3_example
│ │ ├── Turtlebot3Goal.h
│ │ ├── Turtlebot3Feedback.h
│ │ └── Turtlebot3Result.h
│ │ ├── sound_play
│ │ ├── SoundRequestGoal.h
│ │ └── SoundRequestActionGoal.h
│ │ ├── uuid_msgs
│ │ └── UniqueID.h
│ │ ├── moveit_msgs
│ │ ├── ExecuteTrajectoryGoal.h
│ │ ├── ExecuteTrajectoryResult.h
│ │ ├── MoveGroupSequenceResult.h
│ │ ├── OrientedBoundingBox.h
│ │ ├── MotionSequenceItem.h
│ │ ├── MoveGroupGoal.h
│ │ ├── PlaceFeedback.h
│ │ ├── MoveGroupSequenceGoal.h
│ │ ├── PickupFeedback.h
│ │ ├── MoveGroupFeedback.h
│ │ ├── ExecuteTrajectoryFeedback.h
│ │ ├── MoveGroupSequenceFeedback.h
│ │ ├── RobotTrajectory.h
│ │ ├── CostSource.h
│ │ ├── PlaceActionGoal.h
│ │ ├── PickupActionGoal.h
│ │ ├── MoveGroupActionGoal.h
│ │ ├── PlaceActionResult.h
│ │ ├── PickupActionResult.h
│ │ ├── WorkspaceParameters.h
│ │ └── PlaceActionFeedback.h
│ │ ├── turtlebot3_msgs
│ │ └── Sound.h
│ │ ├── geometry_msgs
│ │ ├── Wrench.h
│ │ ├── Accel.h
│ │ ├── Twist.h
│ │ ├── PoseStamped.h
│ │ ├── AccelStamped.h
│ │ ├── PointStamped.h
│ │ ├── TwistStamped.h
│ │ ├── WrenchStamped.h
│ │ ├── Pose.h
│ │ ├── Vector3Stamped.h
│ │ ├── InertiaStamped.h
│ │ ├── PolygonStamped.h
│ │ ├── Transform.h
│ │ ├── QuaternionStamped.h
│ │ ├── Point.h
│ │ ├── Vector3.h
│ │ ├── PoseWithCovarianceStamped.h
│ │ ├── PoseWithCovariance.h
│ │ ├── Pose2D.h
│ │ ├── AccelWithCovarianceStamped.h
│ │ ├── TwistWithCovarianceStamped.h
│ │ ├── AccelWithCovariance.h
│ │ ├── TwistWithCovariance.h
│ │ └── Quaternion.h
│ │ ├── geographic_msgs
│ │ ├── BoundingBox.h
│ │ ├── GeoPoseStamped.h
│ │ ├── GeoPointStamped.h
│ │ ├── GeoPose.h
│ │ └── GeoPoint.h
│ │ ├── people_msgs
│ │ └── PersonStamped.h
│ │ ├── jsk_recognition_msgs
│ │ ├── Segment.h
│ │ ├── SegmentStamped.h
│ │ ├── RotatedRectStamped.h
│ │ ├── SimpleHandle.h
│ │ └── Line.h
│ │ ├── roscpp
│ │ └── Empty.h
│ │ ├── std_srvs
│ │ └── Empty.h
│ │ ├── map_msgs
│ │ └── ProjectedMap.h
│ │ ├── turtlesim
│ │ └── Color.h
│ │ ├── sensor_msgs
│ │ ├── Illuminance.h
│ │ ├── Temperature.h
│ │ ├── FluidPressure.h
│ │ └── RelativeHumidity.h
│ │ ├── octomap_msgs
│ │ └── OctomapWithPose.h
│ │ ├── posedetection_msgs
│ │ ├── ImageFeature0D.h
│ │ └── ImageFeature1D.h
│ │ └── jsk_rviz_plugins
│ │ └── ObjectFitCommand.h
├── test
│ └── README
├── platformio.ini
└── include
│ └── README
├── ros_face_driver
└── launch
│ └── base_driver.launch
├── ros_face_apps
└── launch
│ └── face_control_joy.launch
├── .github
└── workflows
│ ├── ROS1_melodic.yml
│ └── arduino.yml
└── LICENSE
/ros_face_msgs/msg/Ch.msg:
--------------------------------------------------------------------------------
1 | bool state
2 | float32 time
--------------------------------------------------------------------------------
/.gitignore:
--------------------------------------------------------------------------------
1 | *.swp
2 | .vscode/
3 | workspace.code-workspace
--------------------------------------------------------------------------------
/ros_face_Arduino/.gitignore:
--------------------------------------------------------------------------------
1 | .pio
2 | .vscode/.browse.c_cpp.db*
3 | .vscode/c_cpp_properties.json
4 | .vscode/launch.json
5 | .vscode/ipch
6 |
--------------------------------------------------------------------------------
/ros_face_msgs/msg/FaceCmd.msg:
--------------------------------------------------------------------------------
1 | Ch ch1
2 | Ch ch2
3 | Ch ch3
4 | Ch ch4
5 | Ch ch5
6 | Ch ch6
7 | Ch ch7
8 | Ch ch8
9 | Ch ch9
10 | Ch ch10
--------------------------------------------------------------------------------
/ros_face_driver/launch/base_driver.launch:
--------------------------------------------------------------------------------
1 |
2 |
3 |
4 |
5 |
6 |
7 |
8 |
--------------------------------------------------------------------------------
/ros_face_apps/launch/face_control_joy.launch:
--------------------------------------------------------------------------------
1 |
2 |
3 |
4 |
5 |
6 |
7 |
8 |
9 |
10 |
11 |
12 |
13 |
14 |
15 |
16 |
17 |
--------------------------------------------------------------------------------
/.github/workflows/ROS1_melodic.yml:
--------------------------------------------------------------------------------
1 | name: ROS1 melodic
2 |
3 | on: [push]
4 |
5 | jobs:
6 | industrial_ci:
7 | strategy:
8 | matrix:
9 | env:
10 | - {ROS_DISTRO: "melodic",
11 | ROS_REPO: "main",
12 | CATKIN_LINT: "false",
13 | OPT_VI: "-vi",
14 | CATKIN_LINT_ARGS: "--ignore unknown_package"}
15 |
16 | runs-on: ubuntu-latest
17 | steps:
18 | - uses: actions/checkout@v2
19 | - uses: 'ros-industrial/industrial_ci@master'
20 | env: ${{matrix.env}}
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/examples/ServiceClient/client.py:
--------------------------------------------------------------------------------
1 | #!/usr/bin/env python
2 |
3 | """
4 | Sample code to use with ServiceClient.pde
5 | """
6 |
7 | import roslib; roslib.load_manifest("rosserial_arduino")
8 | import rospy
9 |
10 | from rosserial_arduino.srv import *
11 |
12 | def callback(req):
13 | print "The arduino is calling! Please send it a message:"
14 | t = TestResponse()
15 | t.output = raw_input()
16 | return t
17 |
18 | rospy.init_node("service_client_test")
19 | rospy.Service("test_srv", Test, callback)
20 | rospy.spin()
21 |
--------------------------------------------------------------------------------
/ros_face_Arduino/test/README:
--------------------------------------------------------------------------------
1 |
2 | This directory is intended for PlatformIO Unit Testing and project tests.
3 |
4 | Unit Testing is a software testing method by which individual units of
5 | source code, sets of one or more MCU program modules together with associated
6 | control data, usage procedures, and operating procedures, are tested to
7 | determine whether they are fit for use. Unit testing finds problems early
8 | in the development cycle.
9 |
10 | More information about PlatformIO Unit Testing:
11 | - https://docs.platformio.org/page/plus/unit-testing.html
12 |
--------------------------------------------------------------------------------
/ros_face_Arduino/platformio.ini:
--------------------------------------------------------------------------------
1 | ; PlatformIO Project Configuration File
2 | ;
3 | ; Build options: build flags, source filter
4 | ; Upload options: custom upload port, speed and extra flags
5 | ; Library options: dependencies, extra library storages
6 | ; Advanced options: extra scripting
7 | ;
8 | ; Please visit documentation for the other options and examples
9 | ; https://docs.platformio.org/page/projectconf.html
10 |
11 | [env:uno]
12 | platform = atmelavr
13 | board = uno
14 | framework = arduino
15 |
16 | lib_deps =
17 | arduino-libraries/Servo @ 1.1.8
18 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/tests/time_test/time_test.pde:
--------------------------------------------------------------------------------
1 | /*
2 | * rosserial::std_msgs::Time Test
3 | * Publishes current time
4 | */
5 |
6 | #include
7 | #include
8 | #include
9 |
10 |
11 | ros::NodeHandle nh;
12 |
13 | std_msgs::Time test;
14 | ros::Publisher p("my_topic", &test);
15 |
16 | void setup()
17 | {
18 | pinMode(13, OUTPUT);
19 | nh.initNode();
20 | nh.advertise(p);
21 | }
22 |
23 | void loop()
24 | {
25 | test.data = nh.now();
26 | p.publish( &test );
27 | nh.spinOnce();
28 | delay(10);
29 | }
30 |
31 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/examples/HelloWorld/HelloWorld.pde:
--------------------------------------------------------------------------------
1 | /*
2 | * rosserial Publisher Example
3 | * Prints "hello world!"
4 | */
5 |
6 | #include
7 | #include
8 |
9 | ros::NodeHandle nh;
10 |
11 | std_msgs::String str_msg;
12 | ros::Publisher chatter("chatter", &str_msg);
13 |
14 | char hello[13] = "hello world!";
15 |
16 | void setup()
17 | {
18 | nh.initNode();
19 | nh.advertise(chatter);
20 | }
21 |
22 | void loop()
23 | {
24 | str_msg.data = hello;
25 | chatter.publish( &str_msg );
26 | nh.spinOnce();
27 | delay(1000);
28 | }
29 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/examples/Blink/Blink.pde:
--------------------------------------------------------------------------------
1 | /*
2 | * rosserial Subscriber Example
3 | * Blinks an LED on callback
4 | */
5 |
6 | #include
7 | #include
8 |
9 | ros::NodeHandle nh;
10 |
11 | void messageCb( const std_msgs::Empty& toggle_msg){
12 | digitalWrite(LED_BUILTIN, HIGH-digitalRead(LED_BUILTIN)); // blink the led
13 | }
14 |
15 | ros::Subscriber sub("toggle_led", &messageCb );
16 |
17 | void setup()
18 | {
19 | pinMode(LED_BUILTIN, OUTPUT);
20 | nh.initNode();
21 | nh.subscribe(sub);
22 | }
23 |
24 | void loop()
25 | {
26 | nh.spinOnce();
27 | delay(1);
28 | }
29 |
30 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/std_msgs/Empty.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_std_msgs_Empty_h
2 | #define _ROS_std_msgs_Empty_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace std_msgs
10 | {
11 |
12 | class Empty : public ros::Msg
13 | {
14 | public:
15 |
16 | Empty()
17 | {
18 | }
19 |
20 | virtual int serialize(unsigned char *outbuffer) const
21 | {
22 | int offset = 0;
23 | return offset;
24 | }
25 |
26 | virtual int deserialize(unsigned char *inbuffer)
27 | {
28 | int offset = 0;
29 | return offset;
30 | }
31 |
32 | const char * getType(){ return "std_msgs/Empty"; };
33 | const char * getMD5(){ return "d41d8cd98f00b204e9800998ecf8427e"; };
34 |
35 | };
36 |
37 | }
38 | #endif
39 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/nav_msgs/GetMapGoal.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_nav_msgs_GetMapGoal_h
2 | #define _ROS_nav_msgs_GetMapGoal_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace nav_msgs
10 | {
11 |
12 | class GetMapGoal : public ros::Msg
13 | {
14 | public:
15 |
16 | GetMapGoal()
17 | {
18 | }
19 |
20 | virtual int serialize(unsigned char *outbuffer) const
21 | {
22 | int offset = 0;
23 | return offset;
24 | }
25 |
26 | virtual int deserialize(unsigned char *inbuffer)
27 | {
28 | int offset = 0;
29 | return offset;
30 | }
31 |
32 | const char * getType(){ return "nav_msgs/GetMapGoal"; };
33 | const char * getMD5(){ return "d41d8cd98f00b204e9800998ecf8427e"; };
34 |
35 | };
36 |
37 | }
38 | #endif
39 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/tests/float64_test/float64_test.pde:
--------------------------------------------------------------------------------
1 | /*
2 | * rosserial::std_msgs::Float64 Test
3 | * Receives a Float64 input, subtracts 1.0, and publishes it
4 | */
5 |
6 | #include
7 | #include
8 |
9 |
10 | ros::NodeHandle nh;
11 |
12 | float x;
13 |
14 | void messageCb( const std_msgs::Float64& msg){
15 | x = msg.data - 1.0;
16 | digitalWrite(13, HIGH-digitalRead(13)); // blink the led
17 | }
18 |
19 | std_msgs::Float64 test;
20 | ros::Subscriber s("your_topic", &messageCb);
21 | ros::Publisher p("my_topic", &test);
22 |
23 | void setup()
24 | {
25 | pinMode(13, OUTPUT);
26 | nh.initNode();
27 | nh.advertise(p);
28 | nh.subscribe(s);
29 | }
30 |
31 | void loop()
32 | {
33 | test.data = x;
34 | p.publish( &test );
35 | nh.spinOnce();
36 | delay(10);
37 | }
38 |
39 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/nav_msgs/GetMapFeedback.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_nav_msgs_GetMapFeedback_h
2 | #define _ROS_nav_msgs_GetMapFeedback_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace nav_msgs
10 | {
11 |
12 | class GetMapFeedback : public ros::Msg
13 | {
14 | public:
15 |
16 | GetMapFeedback()
17 | {
18 | }
19 |
20 | virtual int serialize(unsigned char *outbuffer) const
21 | {
22 | int offset = 0;
23 | return offset;
24 | }
25 |
26 | virtual int deserialize(unsigned char *inbuffer)
27 | {
28 | int offset = 0;
29 | return offset;
30 | }
31 |
32 | const char * getType(){ return "nav_msgs/GetMapFeedback"; };
33 | const char * getMD5(){ return "d41d8cd98f00b204e9800998ecf8427e"; };
34 |
35 | };
36 |
37 | }
38 | #endif
39 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/actionlib/TwoIntsFeedback.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_actionlib_TwoIntsFeedback_h
2 | #define _ROS_actionlib_TwoIntsFeedback_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace actionlib
10 | {
11 |
12 | class TwoIntsFeedback : public ros::Msg
13 | {
14 | public:
15 |
16 | TwoIntsFeedback()
17 | {
18 | }
19 |
20 | virtual int serialize(unsigned char *outbuffer) const
21 | {
22 | int offset = 0;
23 | return offset;
24 | }
25 |
26 | virtual int deserialize(unsigned char *inbuffer)
27 | {
28 | int offset = 0;
29 | return offset;
30 | }
31 |
32 | const char * getType(){ return "actionlib/TwoIntsFeedback"; };
33 | const char * getMD5(){ return "d41d8cd98f00b204e9800998ecf8427e"; };
34 |
35 | };
36 |
37 | }
38 | #endif
39 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/control_msgs/PointHeadResult.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_control_msgs_PointHeadResult_h
2 | #define _ROS_control_msgs_PointHeadResult_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace control_msgs
10 | {
11 |
12 | class PointHeadResult : public ros::Msg
13 | {
14 | public:
15 |
16 | PointHeadResult()
17 | {
18 | }
19 |
20 | virtual int serialize(unsigned char *outbuffer) const
21 | {
22 | int offset = 0;
23 | return offset;
24 | }
25 |
26 | virtual int deserialize(unsigned char *inbuffer)
27 | {
28 | int offset = 0;
29 | return offset;
30 | }
31 |
32 | const char * getType(){ return "control_msgs/PointHeadResult"; };
33 | const char * getMD5(){ return "d41d8cd98f00b204e9800998ecf8427e"; };
34 |
35 | };
36 |
37 | }
38 | #endif
39 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/examples/pubsub/pubsub.pde:
--------------------------------------------------------------------------------
1 | /*
2 | * rosserial PubSub Example
3 | * Prints "hello world!" and toggles led
4 | */
5 |
6 | #include
7 | #include
8 | #include
9 |
10 | ros::NodeHandle nh;
11 |
12 |
13 | void messageCb( const std_msgs::Empty& toggle_msg){
14 | digitalWrite(13, HIGH-digitalRead(13)); // blink the led
15 | }
16 |
17 | ros::Subscriber sub("toggle_led", messageCb );
18 |
19 |
20 |
21 | std_msgs::String str_msg;
22 | ros::Publisher chatter("chatter", &str_msg);
23 |
24 | char hello[13] = "hello world!";
25 |
26 | void setup()
27 | {
28 | pinMode(13, OUTPUT);
29 | nh.initNode();
30 | nh.advertise(chatter);
31 | nh.subscribe(sub);
32 | }
33 |
34 | void loop()
35 | {
36 | str_msg.data = hello;
37 | chatter.publish( &str_msg );
38 | nh.spinOnce();
39 | delay(500);
40 | }
41 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/move_base_msgs/MoveBaseResult.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_move_base_msgs_MoveBaseResult_h
2 | #define _ROS_move_base_msgs_MoveBaseResult_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace move_base_msgs
10 | {
11 |
12 | class MoveBaseResult : public ros::Msg
13 | {
14 | public:
15 |
16 | MoveBaseResult()
17 | {
18 | }
19 |
20 | virtual int serialize(unsigned char *outbuffer) const
21 | {
22 | int offset = 0;
23 | return offset;
24 | }
25 |
26 | virtual int deserialize(unsigned char *inbuffer)
27 | {
28 | int offset = 0;
29 | return offset;
30 | }
31 |
32 | const char * getType(){ return "move_base_msgs/MoveBaseResult"; };
33 | const char * getMD5(){ return "d41d8cd98f00b204e9800998ecf8427e"; };
34 |
35 | };
36 |
37 | }
38 | #endif
39 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/actionlib/TestRequestFeedback.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_actionlib_TestRequestFeedback_h
2 | #define _ROS_actionlib_TestRequestFeedback_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace actionlib
10 | {
11 |
12 | class TestRequestFeedback : public ros::Msg
13 | {
14 | public:
15 |
16 | TestRequestFeedback()
17 | {
18 | }
19 |
20 | virtual int serialize(unsigned char *outbuffer) const
21 | {
22 | int offset = 0;
23 | return offset;
24 | }
25 |
26 | virtual int deserialize(unsigned char *inbuffer)
27 | {
28 | int offset = 0;
29 | return offset;
30 | }
31 |
32 | const char * getType(){ return "actionlib/TestRequestFeedback"; };
33 | const char * getMD5(){ return "d41d8cd98f00b204e9800998ecf8427e"; };
34 |
35 | };
36 |
37 | }
38 | #endif
39 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/turtle_actionlib/ShapeFeedback.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_turtle_actionlib_ShapeFeedback_h
2 | #define _ROS_turtle_actionlib_ShapeFeedback_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace turtle_actionlib
10 | {
11 |
12 | class ShapeFeedback : public ros::Msg
13 | {
14 | public:
15 |
16 | ShapeFeedback()
17 | {
18 | }
19 |
20 | virtual int serialize(unsigned char *outbuffer) const
21 | {
22 | int offset = 0;
23 | return offset;
24 | }
25 |
26 | virtual int deserialize(unsigned char *inbuffer)
27 | {
28 | int offset = 0;
29 | return offset;
30 | }
31 |
32 | const char * getType(){ return "turtle_actionlib/ShapeFeedback"; };
33 | const char * getMD5(){ return "d41d8cd98f00b204e9800998ecf8427e"; };
34 |
35 | };
36 |
37 | }
38 | #endif
39 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/examples/TimeTF/TimeTF.pde:
--------------------------------------------------------------------------------
1 | /*
2 | * rosserial Time and TF Example
3 | * Publishes a transform at current time
4 | */
5 |
6 | #include
7 | #include
8 | #include
9 |
10 | ros::NodeHandle nh;
11 |
12 | geometry_msgs::TransformStamped t;
13 | tf::TransformBroadcaster broadcaster;
14 |
15 | char base_link[] = "/base_link";
16 | char odom[] = "/odom";
17 |
18 | void setup()
19 | {
20 | nh.initNode();
21 | broadcaster.init(nh);
22 | }
23 |
24 | void loop()
25 | {
26 | t.header.frame_id = odom;
27 | t.child_frame_id = base_link;
28 | t.transform.translation.x = 1.0;
29 | t.transform.rotation.x = 0.0;
30 | t.transform.rotation.y = 0.0;
31 | t.transform.rotation.z = 0.0;
32 | t.transform.rotation.w = 1.0;
33 | t.header.stamp = nh.now();
34 | broadcaster.sendTransform(t);
35 | nh.spinOnce();
36 | delay(10);
37 | }
38 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/tf2_msgs/LookupTransformFeedback.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_tf2_msgs_LookupTransformFeedback_h
2 | #define _ROS_tf2_msgs_LookupTransformFeedback_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace tf2_msgs
10 | {
11 |
12 | class LookupTransformFeedback : public ros::Msg
13 | {
14 | public:
15 |
16 | LookupTransformFeedback()
17 | {
18 | }
19 |
20 | virtual int serialize(unsigned char *outbuffer) const
21 | {
22 | int offset = 0;
23 | return offset;
24 | }
25 |
26 | virtual int deserialize(unsigned char *inbuffer)
27 | {
28 | int offset = 0;
29 | return offset;
30 | }
31 |
32 | const char * getType(){ return "tf2_msgs/LookupTransformFeedback"; };
33 | const char * getMD5(){ return "d41d8cd98f00b204e9800998ecf8427e"; };
34 |
35 | };
36 |
37 | }
38 | #endif
39 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/control_msgs/JointTrajectoryResult.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_control_msgs_JointTrajectoryResult_h
2 | #define _ROS_control_msgs_JointTrajectoryResult_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace control_msgs
10 | {
11 |
12 | class JointTrajectoryResult : public ros::Msg
13 | {
14 | public:
15 |
16 | JointTrajectoryResult()
17 | {
18 | }
19 |
20 | virtual int serialize(unsigned char *outbuffer) const
21 | {
22 | int offset = 0;
23 | return offset;
24 | }
25 |
26 | virtual int deserialize(unsigned char *inbuffer)
27 | {
28 | int offset = 0;
29 | return offset;
30 | }
31 |
32 | const char * getType(){ return "control_msgs/JointTrajectoryResult"; };
33 | const char * getMD5(){ return "d41d8cd98f00b204e9800998ecf8427e"; };
34 |
35 | };
36 |
37 | }
38 | #endif
39 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/examples/ServiceClient/ServiceClient.pde:
--------------------------------------------------------------------------------
1 | /*
2 | * rosserial Service Client
3 | */
4 |
5 | #include
6 | #include
7 | #include
8 |
9 | ros::NodeHandle nh;
10 | using rosserial_arduino::Test;
11 |
12 | ros::ServiceClient client("test_srv");
13 |
14 | std_msgs::String str_msg;
15 | ros::Publisher chatter("chatter", &str_msg);
16 |
17 | char hello[13] = "hello world!";
18 |
19 | void setup()
20 | {
21 | nh.initNode();
22 | nh.serviceClient(client);
23 | nh.advertise(chatter);
24 | while(!nh.connected()) nh.spinOnce();
25 | nh.loginfo("Startup complete");
26 | }
27 |
28 | void loop()
29 | {
30 | Test::Request req;
31 | Test::Response res;
32 | req.input = hello;
33 | client.call(req, res);
34 | str_msg.data = res.output;
35 | chatter.publish( &str_msg );
36 | nh.spinOnce();
37 | delay(100);
38 | }
39 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/examples/ServiceServer/ServiceServer.pde:
--------------------------------------------------------------------------------
1 | /*
2 | * rosserial Service Server
3 | */
4 |
5 | #include
6 | #include
7 | #include
8 |
9 | ros::NodeHandle nh;
10 | using rosserial_arduino::Test;
11 |
12 | int i;
13 | void callback(const Test::Request & req, Test::Response & res){
14 | if((i++)%2)
15 | res.output = "hello";
16 | else
17 | res.output = "world";
18 | }
19 |
20 | ros::ServiceServer server("test_srv",&callback);
21 |
22 | std_msgs::String str_msg;
23 | ros::Publisher chatter("chatter", &str_msg);
24 |
25 | char hello[13] = "hello world!";
26 |
27 | void setup()
28 | {
29 | nh.initNode();
30 | nh.advertiseService(server);
31 | nh.advertise(chatter);
32 | }
33 |
34 | void loop()
35 | {
36 | str_msg.data = hello;
37 | chatter.publish( &str_msg );
38 | nh.spinOnce();
39 | delay(10);
40 | }
41 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/control_msgs/JointTrajectoryFeedback.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_control_msgs_JointTrajectoryFeedback_h
2 | #define _ROS_control_msgs_JointTrajectoryFeedback_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace control_msgs
10 | {
11 |
12 | class JointTrajectoryFeedback : public ros::Msg
13 | {
14 | public:
15 |
16 | JointTrajectoryFeedback()
17 | {
18 | }
19 |
20 | virtual int serialize(unsigned char *outbuffer) const
21 | {
22 | int offset = 0;
23 | return offset;
24 | }
25 |
26 | virtual int deserialize(unsigned char *inbuffer)
27 | {
28 | int offset = 0;
29 | return offset;
30 | }
31 |
32 | const char * getType(){ return "control_msgs/JointTrajectoryFeedback"; };
33 | const char * getMD5(){ return "d41d8cd98f00b204e9800998ecf8427e"; };
34 |
35 | };
36 |
37 | }
38 | #endif
39 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/jsk_footstep_msgs/ExecFootstepsResult.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_jsk_footstep_msgs_ExecFootstepsResult_h
2 | #define _ROS_jsk_footstep_msgs_ExecFootstepsResult_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace jsk_footstep_msgs
10 | {
11 |
12 | class ExecFootstepsResult : public ros::Msg
13 | {
14 | public:
15 |
16 | ExecFootstepsResult()
17 | {
18 | }
19 |
20 | virtual int serialize(unsigned char *outbuffer) const
21 | {
22 | int offset = 0;
23 | return offset;
24 | }
25 |
26 | virtual int deserialize(unsigned char *inbuffer)
27 | {
28 | int offset = 0;
29 | return offset;
30 | }
31 |
32 | const char * getType(){ return "jsk_footstep_msgs/ExecFootstepsResult"; };
33 | const char * getMD5(){ return "d41d8cd98f00b204e9800998ecf8427e"; };
34 |
35 | };
36 |
37 | }
38 | #endif
39 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/control_msgs/SingleJointPositionResult.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_control_msgs_SingleJointPositionResult_h
2 | #define _ROS_control_msgs_SingleJointPositionResult_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace control_msgs
10 | {
11 |
12 | class SingleJointPositionResult : public ros::Msg
13 | {
14 | public:
15 |
16 | SingleJointPositionResult()
17 | {
18 | }
19 |
20 | virtual int serialize(unsigned char *outbuffer) const
21 | {
22 | int offset = 0;
23 | return offset;
24 | }
25 |
26 | virtual int deserialize(unsigned char *inbuffer)
27 | {
28 | int offset = 0;
29 | return offset;
30 | }
31 |
32 | const char * getType(){ return "control_msgs/SingleJointPositionResult"; };
33 | const char * getMD5(){ return "d41d8cd98f00b204e9800998ecf8427e"; };
34 |
35 | };
36 |
37 | }
38 | #endif
39 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/jsk_footstep_msgs/ExecFootstepsFeedback.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_jsk_footstep_msgs_ExecFootstepsFeedback_h
2 | #define _ROS_jsk_footstep_msgs_ExecFootstepsFeedback_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace jsk_footstep_msgs
10 | {
11 |
12 | class ExecFootstepsFeedback : public ros::Msg
13 | {
14 | public:
15 |
16 | ExecFootstepsFeedback()
17 | {
18 | }
19 |
20 | virtual int serialize(unsigned char *outbuffer) const
21 | {
22 | int offset = 0;
23 | return offset;
24 | }
25 |
26 | virtual int deserialize(unsigned char *inbuffer)
27 | {
28 | int offset = 0;
29 | return offset;
30 | }
31 |
32 | const char * getType(){ return "jsk_footstep_msgs/ExecFootstepsFeedback"; };
33 | const char * getMD5(){ return "d41d8cd98f00b204e9800998ecf8427e"; };
34 |
35 | };
36 |
37 | }
38 | #endif
39 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/examples/Logging/Logging.pde:
--------------------------------------------------------------------------------
1 | /*
2 | * rosserial PubSub Example
3 | * Prints "hello world!" and toggles led
4 | */
5 |
6 | #include
7 | #include
8 | #include
9 |
10 | ros::NodeHandle nh;
11 |
12 |
13 | std_msgs::String str_msg;
14 | ros::Publisher chatter("chatter", &str_msg);
15 |
16 | char hello[13] = "hello world!";
17 |
18 |
19 | char debug[]= "debug statements";
20 | char info[] = "infos";
21 | char warn[] = "warnings";
22 | char error[] = "errors";
23 | char fatal[] = "fatalities";
24 |
25 | void setup()
26 | {
27 | pinMode(13, OUTPUT);
28 | nh.initNode();
29 | nh.advertise(chatter);
30 | }
31 |
32 | void loop()
33 | {
34 | str_msg.data = hello;
35 | chatter.publish( &str_msg );
36 |
37 | nh.logdebug(debug);
38 | nh.loginfo(info);
39 | nh.logwarn(warn);
40 | nh.logerror(error);
41 | nh.logfatal(fatal);
42 |
43 | nh.spinOnce();
44 | delay(500);
45 | }
46 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/object_recognition_msgs/ObjectRecognitionFeedback.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_object_recognition_msgs_ObjectRecognitionFeedback_h
2 | #define _ROS_object_recognition_msgs_ObjectRecognitionFeedback_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace object_recognition_msgs
10 | {
11 |
12 | class ObjectRecognitionFeedback : public ros::Msg
13 | {
14 | public:
15 |
16 | ObjectRecognitionFeedback()
17 | {
18 | }
19 |
20 | virtual int serialize(unsigned char *outbuffer) const
21 | {
22 | int offset = 0;
23 | return offset;
24 | }
25 |
26 | virtual int deserialize(unsigned char *inbuffer)
27 | {
28 | int offset = 0;
29 | return offset;
30 | }
31 |
32 | const char * getType(){ return "object_recognition_msgs/ObjectRecognitionFeedback"; };
33 | const char * getMD5(){ return "d41d8cd98f00b204e9800998ecf8427e"; };
34 |
35 | };
36 |
37 | }
38 | #endif
39 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/dynamic_reconfigure/SensorLevels.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_dynamic_reconfigure_SensorLevels_h
2 | #define _ROS_dynamic_reconfigure_SensorLevels_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace dynamic_reconfigure
10 | {
11 |
12 | class SensorLevels : public ros::Msg
13 | {
14 | public:
15 | enum { RECONFIGURE_CLOSE = 3 };
16 | enum { RECONFIGURE_STOP = 1 };
17 | enum { RECONFIGURE_RUNNING = 0 };
18 |
19 | SensorLevels()
20 | {
21 | }
22 |
23 | virtual int serialize(unsigned char *outbuffer) const
24 | {
25 | int offset = 0;
26 | return offset;
27 | }
28 |
29 | virtual int deserialize(unsigned char *inbuffer)
30 | {
31 | int offset = 0;
32 | return offset;
33 | }
34 |
35 | const char * getType(){ return "dynamic_reconfigure/SensorLevels"; };
36 | const char * getMD5(){ return "6322637bee96d5489db6e2127c47602c"; };
37 |
38 | };
39 |
40 | }
41 | #endif
42 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/std_msgs/Float64.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_std_msgs_Float64_h
2 | #define _ROS_std_msgs_Float64_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace std_msgs
10 | {
11 |
12 | class Float64 : public ros::Msg
13 | {
14 | public:
15 | typedef float _data_type;
16 | _data_type data;
17 |
18 | Float64():
19 | data(0)
20 | {
21 | }
22 |
23 | virtual int serialize(unsigned char *outbuffer) const
24 | {
25 | int offset = 0;
26 | offset += serializeAvrFloat64(outbuffer + offset, this->data);
27 | return offset;
28 | }
29 |
30 | virtual int deserialize(unsigned char *inbuffer)
31 | {
32 | int offset = 0;
33 | offset += deserializeAvrFloat64(inbuffer + offset, &(this->data));
34 | return offset;
35 | }
36 |
37 | const char * getType(){ return "std_msgs/Float64"; };
38 | const char * getMD5(){ return "fdb28210bfa9d7c91146260178d9a584"; };
39 |
40 | };
41 |
42 | }
43 | #endif
44 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/std_msgs/Char.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_std_msgs_Char_h
2 | #define _ROS_std_msgs_Char_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace std_msgs
10 | {
11 |
12 | class Char : public ros::Msg
13 | {
14 | public:
15 | typedef uint8_t _data_type;
16 | _data_type data;
17 |
18 | Char():
19 | data(0)
20 | {
21 | }
22 |
23 | virtual int serialize(unsigned char *outbuffer) const
24 | {
25 | int offset = 0;
26 | *(outbuffer + offset + 0) = (this->data >> (8 * 0)) & 0xFF;
27 | offset += sizeof(this->data);
28 | return offset;
29 | }
30 |
31 | virtual int deserialize(unsigned char *inbuffer)
32 | {
33 | int offset = 0;
34 | this->data = ((uint8_t) (*(inbuffer + offset)));
35 | offset += sizeof(this->data);
36 | return offset;
37 | }
38 |
39 | const char * getType(){ return "std_msgs/Char"; };
40 | const char * getMD5(){ return "1bf77f25acecdedba0e224b162199717"; };
41 |
42 | };
43 |
44 | }
45 | #endif
46 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/std_msgs/UInt8.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_std_msgs_UInt8_h
2 | #define _ROS_std_msgs_UInt8_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace std_msgs
10 | {
11 |
12 | class UInt8 : public ros::Msg
13 | {
14 | public:
15 | typedef uint8_t _data_type;
16 | _data_type data;
17 |
18 | UInt8():
19 | data(0)
20 | {
21 | }
22 |
23 | virtual int serialize(unsigned char *outbuffer) const
24 | {
25 | int offset = 0;
26 | *(outbuffer + offset + 0) = (this->data >> (8 * 0)) & 0xFF;
27 | offset += sizeof(this->data);
28 | return offset;
29 | }
30 |
31 | virtual int deserialize(unsigned char *inbuffer)
32 | {
33 | int offset = 0;
34 | this->data = ((uint8_t) (*(inbuffer + offset)));
35 | offset += sizeof(this->data);
36 | return offset;
37 | }
38 |
39 | const char * getType(){ return "std_msgs/UInt8"; };
40 | const char * getMD5(){ return "7c8164229e7d2c17eb95e9231617fdee"; };
41 |
42 | };
43 |
44 | }
45 | #endif
46 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/nav_msgs/GetMapResult.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_nav_msgs_GetMapResult_h
2 | #define _ROS_nav_msgs_GetMapResult_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "nav_msgs/OccupancyGrid.h"
9 |
10 | namespace nav_msgs
11 | {
12 |
13 | class GetMapResult : public ros::Msg
14 | {
15 | public:
16 | typedef nav_msgs::OccupancyGrid _map_type;
17 | _map_type map;
18 |
19 | GetMapResult():
20 | map()
21 | {
22 | }
23 |
24 | virtual int serialize(unsigned char *outbuffer) const
25 | {
26 | int offset = 0;
27 | offset += this->map.serialize(outbuffer + offset);
28 | return offset;
29 | }
30 |
31 | virtual int deserialize(unsigned char *inbuffer)
32 | {
33 | int offset = 0;
34 | offset += this->map.deserialize(inbuffer + offset);
35 | return offset;
36 | }
37 |
38 | const char * getType(){ return "nav_msgs/GetMapResult"; };
39 | const char * getMD5(){ return "6cdd0a18e0aff5b0a3ca2326a89b54ff"; };
40 |
41 | };
42 |
43 | }
44 | #endif
45 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/jsk_gui_msgs/Gravity.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_jsk_gui_msgs_Gravity_h
2 | #define _ROS_jsk_gui_msgs_Gravity_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "geometry_msgs/Vector3.h"
9 |
10 | namespace jsk_gui_msgs
11 | {
12 |
13 | class Gravity : public ros::Msg
14 | {
15 | public:
16 | typedef geometry_msgs::Vector3 _gravity_type;
17 | _gravity_type gravity;
18 |
19 | Gravity():
20 | gravity()
21 | {
22 | }
23 |
24 | virtual int serialize(unsigned char *outbuffer) const
25 | {
26 | int offset = 0;
27 | offset += this->gravity.serialize(outbuffer + offset);
28 | return offset;
29 | }
30 |
31 | virtual int deserialize(unsigned char *inbuffer)
32 | {
33 | int offset = 0;
34 | offset += this->gravity.deserialize(inbuffer + offset);
35 | return offset;
36 | }
37 |
38 | const char * getType(){ return "jsk_gui_msgs/Gravity"; };
39 | const char * getMD5(){ return "86facaf836997cbbc4faee170616f59e"; };
40 |
41 | };
42 |
43 | }
44 | #endif
45 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/shape_msgs/Plane.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_shape_msgs_Plane_h
2 | #define _ROS_shape_msgs_Plane_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace shape_msgs
10 | {
11 |
12 | class Plane : public ros::Msg
13 | {
14 | public:
15 | float coef[4];
16 |
17 | Plane():
18 | coef()
19 | {
20 | }
21 |
22 | virtual int serialize(unsigned char *outbuffer) const
23 | {
24 | int offset = 0;
25 | for( uint32_t i = 0; i < 4; i++){
26 | offset += serializeAvrFloat64(outbuffer + offset, this->coef[i]);
27 | }
28 | return offset;
29 | }
30 |
31 | virtual int deserialize(unsigned char *inbuffer)
32 | {
33 | int offset = 0;
34 | for( uint32_t i = 0; i < 4; i++){
35 | offset += deserializeAvrFloat64(inbuffer + offset, &(this->coef[i]));
36 | }
37 | return offset;
38 | }
39 |
40 | const char * getType(){ return "shape_msgs/Plane"; };
41 | const char * getMD5(){ return "2c1b92ed8f31492f8e73f6a4a44ca796"; };
42 |
43 | };
44 |
45 | }
46 | #endif
47 |
--------------------------------------------------------------------------------
/.github/workflows/arduino.yml:
--------------------------------------------------------------------------------
1 | name: PlatformIO CI
2 |
3 | on: [push]
4 |
5 | jobs:
6 | build:
7 |
8 | runs-on: ubuntu-latest
9 |
10 | steps:
11 | - uses: actions/checkout@v2
12 | - name: Cache pip
13 | uses: actions/cache@v2
14 | with:
15 | path: ~/.cache/pip
16 | key: ${{ runner.os }}-pip-${{ hashFiles('**/requirements.txt') }}
17 | restore-keys: |
18 | ${{ runner.os }}-pip-
19 | - name: Cache PlatformIO
20 | uses: actions/cache@v2
21 | with:
22 | path: ~/.platformio
23 | key: ${{ runner.os }}-${{ hashFiles('**/lockfiles') }}
24 |
25 | - name: Set up Python
26 | uses: actions/setup-python@v2
27 |
28 | - name: Install PlatformIO
29 | run: |
30 | python -m pip install --upgrade pip
31 | pip install --upgrade platformio
32 | wget https://github.com/xxxajk/spi4teensy3/archive/master.zip -O /tmp/spi4teensy3.zip
33 | unzip /tmp/spi4teensy3.zip -d /tmp
34 |
35 | - name: Install library dependencies
36 | run: pio lib -g install 1
37 |
38 | - name: Run PlatformIO
39 | run: pio run -d ros_face_Arduino/
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/bond/Constants.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_bond_Constants_h
2 | #define _ROS_bond_Constants_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace bond
10 | {
11 |
12 | class Constants : public ros::Msg
13 | {
14 | public:
15 | enum { DEAD_PUBLISH_PERIOD = 0.05 };
16 | enum { DEFAULT_CONNECT_TIMEOUT = 10.0 };
17 | enum { DEFAULT_HEARTBEAT_TIMEOUT = 4.0 };
18 | enum { DEFAULT_DISCONNECT_TIMEOUT = 2.0 };
19 | enum { DEFAULT_HEARTBEAT_PERIOD = 1.0 };
20 | enum { DISABLE_HEARTBEAT_TIMEOUT_PARAM = /bond_disable_heartbeat_timeout };
21 |
22 | Constants()
23 | {
24 | }
25 |
26 | virtual int serialize(unsigned char *outbuffer) const
27 | {
28 | int offset = 0;
29 | return offset;
30 | }
31 |
32 | virtual int deserialize(unsigned char *inbuffer)
33 | {
34 | int offset = 0;
35 | return offset;
36 | }
37 |
38 | const char * getType(){ return "bond/Constants"; };
39 | const char * getMD5(){ return "6fc594dc1d7bd7919077042712f8c8b0"; };
40 |
41 | };
42 |
43 | }
44 | #endif
45 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/tests/array_test/array_test.pde:
--------------------------------------------------------------------------------
1 | /*
2 | * rosserial::geometry_msgs::PoseArray Test
3 | * Sums an array, publishes sum
4 | */
5 |
6 | #include
7 | #include
8 | #include
9 |
10 |
11 | ros::NodeHandle nh;
12 |
13 |
14 | bool set_;
15 |
16 |
17 | geometry_msgs::Pose sum_msg;
18 | ros::Publisher p("sum", &sum_msg);
19 |
20 | void messageCb(const geometry_msgs::PoseArray& msg){
21 | sum_msg.position.x = 0;
22 | sum_msg.position.y = 0;
23 | sum_msg.position.z = 0;
24 | for(int i = 0; i < msg.poses_length; i++)
25 | {
26 | sum_msg.position.x += msg.poses[i].position.x;
27 | sum_msg.position.y += msg.poses[i].position.y;
28 | sum_msg.position.z += msg.poses[i].position.z;
29 | }
30 | digitalWrite(13, HIGH-digitalRead(13)); // blink the led
31 | }
32 |
33 | ros::Subscriber s("poses",messageCb);
34 |
35 | void setup()
36 | {
37 | pinMode(13, OUTPUT);
38 | nh.initNode();
39 | nh.subscribe(s);
40 | nh.advertise(p);
41 | }
42 |
43 | void loop()
44 | {
45 | p.publish(&sum_msg);
46 | nh.spinOnce();
47 | delay(10);
48 | }
49 |
50 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/turtlebot3_example/Turtlebot3Goal.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_turtlebot3_example_Turtlebot3Goal_h
2 | #define _ROS_turtlebot3_example_Turtlebot3Goal_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "geometry_msgs/Vector3.h"
9 |
10 | namespace turtlebot3_example
11 | {
12 |
13 | class Turtlebot3Goal : public ros::Msg
14 | {
15 | public:
16 | typedef geometry_msgs::Vector3 _goal_type;
17 | _goal_type goal;
18 |
19 | Turtlebot3Goal():
20 | goal()
21 | {
22 | }
23 |
24 | virtual int serialize(unsigned char *outbuffer) const
25 | {
26 | int offset = 0;
27 | offset += this->goal.serialize(outbuffer + offset);
28 | return offset;
29 | }
30 |
31 | virtual int deserialize(unsigned char *inbuffer)
32 | {
33 | int offset = 0;
34 | offset += this->goal.deserialize(inbuffer + offset);
35 | return offset;
36 | }
37 |
38 | const char * getType(){ return "turtlebot3_example/Turtlebot3Goal"; };
39 | const char * getMD5(){ return "8ad3bd0e46ff6777ce7cd2fdd945cb9e"; };
40 |
41 | };
42 |
43 | }
44 | #endif
45 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/jsk_gui_msgs/MagneticField.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_jsk_gui_msgs_MagneticField_h
2 | #define _ROS_jsk_gui_msgs_MagneticField_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "geometry_msgs/Vector3.h"
9 |
10 | namespace jsk_gui_msgs
11 | {
12 |
13 | class MagneticField : public ros::Msg
14 | {
15 | public:
16 | typedef geometry_msgs::Vector3 _magneticfield_type;
17 | _magneticfield_type magneticfield;
18 |
19 | MagneticField():
20 | magneticfield()
21 | {
22 | }
23 |
24 | virtual int serialize(unsigned char *outbuffer) const
25 | {
26 | int offset = 0;
27 | offset += this->magneticfield.serialize(outbuffer + offset);
28 | return offset;
29 | }
30 |
31 | virtual int deserialize(unsigned char *inbuffer)
32 | {
33 | int offset = 0;
34 | offset += this->magneticfield.deserialize(inbuffer + offset);
35 | return offset;
36 | }
37 |
38 | const char * getType(){ return "jsk_gui_msgs/MagneticField"; };
39 | const char * getMD5(){ return "a924df7c82a527d1b76508ed8354604b"; };
40 |
41 | };
42 |
43 | }
44 | #endif
45 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/move_base_msgs/MoveBaseGoal.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_move_base_msgs_MoveBaseGoal_h
2 | #define _ROS_move_base_msgs_MoveBaseGoal_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "geometry_msgs/PoseStamped.h"
9 |
10 | namespace move_base_msgs
11 | {
12 |
13 | class MoveBaseGoal : public ros::Msg
14 | {
15 | public:
16 | typedef geometry_msgs::PoseStamped _target_pose_type;
17 | _target_pose_type target_pose;
18 |
19 | MoveBaseGoal():
20 | target_pose()
21 | {
22 | }
23 |
24 | virtual int serialize(unsigned char *outbuffer) const
25 | {
26 | int offset = 0;
27 | offset += this->target_pose.serialize(outbuffer + offset);
28 | return offset;
29 | }
30 |
31 | virtual int deserialize(unsigned char *inbuffer)
32 | {
33 | int offset = 0;
34 | offset += this->target_pose.deserialize(inbuffer + offset);
35 | return offset;
36 | }
37 |
38 | const char * getType(){ return "move_base_msgs/MoveBaseGoal"; };
39 | const char * getMD5(){ return "257d089627d7eb7136c24d3593d05a16"; };
40 |
41 | };
42 |
43 | }
44 | #endif
45 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/control_msgs/GripperCommandGoal.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_control_msgs_GripperCommandGoal_h
2 | #define _ROS_control_msgs_GripperCommandGoal_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "control_msgs/GripperCommand.h"
9 |
10 | namespace control_msgs
11 | {
12 |
13 | class GripperCommandGoal : public ros::Msg
14 | {
15 | public:
16 | typedef control_msgs::GripperCommand _command_type;
17 | _command_type command;
18 |
19 | GripperCommandGoal():
20 | command()
21 | {
22 | }
23 |
24 | virtual int serialize(unsigned char *outbuffer) const
25 | {
26 | int offset = 0;
27 | offset += this->command.serialize(outbuffer + offset);
28 | return offset;
29 | }
30 |
31 | virtual int deserialize(unsigned char *inbuffer)
32 | {
33 | int offset = 0;
34 | offset += this->command.deserialize(inbuffer + offset);
35 | return offset;
36 | }
37 |
38 | const char * getType(){ return "control_msgs/GripperCommandGoal"; };
39 | const char * getMD5(){ return "86fd82f4ddc48a4cb6856cfa69217e43"; };
40 |
41 | };
42 |
43 | }
44 | #endif
45 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/examples/Odom/Odom.pde:
--------------------------------------------------------------------------------
1 | /*
2 | * rosserial Planar Odometry Example
3 | */
4 |
5 | #include
6 | #include
7 | #include
8 | #include
9 |
10 | ros::NodeHandle nh;
11 |
12 | geometry_msgs::TransformStamped t;
13 | tf::TransformBroadcaster broadcaster;
14 |
15 | double x = 1.0;
16 | double y = 0.0;
17 | double theta = 1.57;
18 |
19 | char base_link[] = "/base_link";
20 | char odom[] = "/odom";
21 |
22 | void setup()
23 | {
24 | nh.initNode();
25 | broadcaster.init(nh);
26 | }
27 |
28 | void loop()
29 | {
30 | // drive in a circle
31 | double dx = 0.2;
32 | double dtheta = 0.18;
33 | x += cos(theta)*dx*0.1;
34 | y += sin(theta)*dx*0.1;
35 | theta += dtheta*0.1;
36 | if(theta > 3.14)
37 | theta=-3.14;
38 |
39 | // tf odom->base_link
40 | t.header.frame_id = odom;
41 | t.child_frame_id = base_link;
42 |
43 | t.transform.translation.x = x;
44 | t.transform.translation.y = y;
45 |
46 | t.transform.rotation = tf::createQuaternionFromYaw(theta);
47 | t.header.stamp = nh.now();
48 |
49 | broadcaster.sendTransform(t);
50 | nh.spinOnce();
51 |
52 | delay(10);
53 | }
54 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/examples/ServoControl/ServoControl.pde:
--------------------------------------------------------------------------------
1 | /*
2 | * rosserial Servo Control Example
3 | *
4 | * This sketch demonstrates the control of hobby R/C servos
5 | * using ROS and the arduiono
6 | *
7 | * For the full tutorial write up, visit
8 | * www.ros.org/wiki/rosserial_arduino_demos
9 | *
10 | * For more information on the Arduino Servo Library
11 | * Checkout :
12 | * http://www.arduino.cc/en/Reference/Servo
13 | */
14 |
15 | #if (ARDUINO >= 100)
16 | #include
17 | #else
18 | #include
19 | #endif
20 |
21 | #include
22 | #include
23 | #include
24 |
25 | ros::NodeHandle nh;
26 |
27 | Servo servo;
28 |
29 | void servo_cb( const std_msgs::UInt16& cmd_msg){
30 | servo.write(cmd_msg.data); //set servo angle, should be from 0-180
31 | digitalWrite(13, HIGH-digitalRead(13)); //toggle led
32 | }
33 |
34 |
35 | ros::Subscriber sub("servo", servo_cb);
36 |
37 | void setup(){
38 | pinMode(13, OUTPUT);
39 |
40 | nh.initNode();
41 | nh.subscribe(sub);
42 |
43 | servo.attach(9); //attach it to pin 9
44 | }
45 |
46 | void loop(){
47 | nh.spinOnce();
48 | delay(1);
49 | }
50 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/sound_play/SoundRequestGoal.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_sound_play_SoundRequestGoal_h
2 | #define _ROS_sound_play_SoundRequestGoal_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "sound_play/SoundRequest.h"
9 |
10 | namespace sound_play
11 | {
12 |
13 | class SoundRequestGoal : public ros::Msg
14 | {
15 | public:
16 | typedef sound_play::SoundRequest _sound_request_type;
17 | _sound_request_type sound_request;
18 |
19 | SoundRequestGoal():
20 | sound_request()
21 | {
22 | }
23 |
24 | virtual int serialize(unsigned char *outbuffer) const
25 | {
26 | int offset = 0;
27 | offset += this->sound_request.serialize(outbuffer + offset);
28 | return offset;
29 | }
30 |
31 | virtual int deserialize(unsigned char *inbuffer)
32 | {
33 | int offset = 0;
34 | offset += this->sound_request.deserialize(inbuffer + offset);
35 | return offset;
36 | }
37 |
38 | const char * getType(){ return "sound_play/SoundRequestGoal"; };
39 | const char * getMD5(){ return "3bd5e9e7f60b85cc6f1b7662fe6e1903"; };
40 |
41 | };
42 |
43 | }
44 | #endif
45 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/uuid_msgs/UniqueID.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_uuid_msgs_UniqueID_h
2 | #define _ROS_uuid_msgs_UniqueID_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace uuid_msgs
10 | {
11 |
12 | class UniqueID : public ros::Msg
13 | {
14 | public:
15 | uint8_t uuid[16];
16 |
17 | UniqueID():
18 | uuid()
19 | {
20 | }
21 |
22 | virtual int serialize(unsigned char *outbuffer) const
23 | {
24 | int offset = 0;
25 | for( uint32_t i = 0; i < 16; i++){
26 | *(outbuffer + offset + 0) = (this->uuid[i] >> (8 * 0)) & 0xFF;
27 | offset += sizeof(this->uuid[i]);
28 | }
29 | return offset;
30 | }
31 |
32 | virtual int deserialize(unsigned char *inbuffer)
33 | {
34 | int offset = 0;
35 | for( uint32_t i = 0; i < 16; i++){
36 | this->uuid[i] = ((uint8_t) (*(inbuffer + offset)));
37 | offset += sizeof(this->uuid[i]);
38 | }
39 | return offset;
40 | }
41 |
42 | const char * getType(){ return "uuid_msgs/UniqueID"; };
43 | const char * getMD5(){ return "fec2a93b6f5367ee8112c9c0b41ff310"; };
44 |
45 | };
46 |
47 | }
48 | #endif
49 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/control_msgs/PointHeadFeedback.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_control_msgs_PointHeadFeedback_h
2 | #define _ROS_control_msgs_PointHeadFeedback_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace control_msgs
10 | {
11 |
12 | class PointHeadFeedback : public ros::Msg
13 | {
14 | public:
15 | typedef float _pointing_angle_error_type;
16 | _pointing_angle_error_type pointing_angle_error;
17 |
18 | PointHeadFeedback():
19 | pointing_angle_error(0)
20 | {
21 | }
22 |
23 | virtual int serialize(unsigned char *outbuffer) const
24 | {
25 | int offset = 0;
26 | offset += serializeAvrFloat64(outbuffer + offset, this->pointing_angle_error);
27 | return offset;
28 | }
29 |
30 | virtual int deserialize(unsigned char *inbuffer)
31 | {
32 | int offset = 0;
33 | offset += deserializeAvrFloat64(inbuffer + offset, &(this->pointing_angle_error));
34 | return offset;
35 | }
36 |
37 | const char * getType(){ return "control_msgs/PointHeadFeedback"; };
38 | const char * getMD5(){ return "cce80d27fd763682da8805a73316cab4"; };
39 |
40 | };
41 |
42 | }
43 | #endif
44 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/move_base_msgs/MoveBaseFeedback.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_move_base_msgs_MoveBaseFeedback_h
2 | #define _ROS_move_base_msgs_MoveBaseFeedback_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "geometry_msgs/PoseStamped.h"
9 |
10 | namespace move_base_msgs
11 | {
12 |
13 | class MoveBaseFeedback : public ros::Msg
14 | {
15 | public:
16 | typedef geometry_msgs::PoseStamped _base_position_type;
17 | _base_position_type base_position;
18 |
19 | MoveBaseFeedback():
20 | base_position()
21 | {
22 | }
23 |
24 | virtual int serialize(unsigned char *outbuffer) const
25 | {
26 | int offset = 0;
27 | offset += this->base_position.serialize(outbuffer + offset);
28 | return offset;
29 | }
30 |
31 | virtual int deserialize(unsigned char *inbuffer)
32 | {
33 | int offset = 0;
34 | offset += this->base_position.deserialize(inbuffer + offset);
35 | return offset;
36 | }
37 |
38 | const char * getType(){ return "move_base_msgs/MoveBaseFeedback"; };
39 | const char * getMD5(){ return "3fb824c456a757373a226f6d08071bf0"; };
40 |
41 | };
42 |
43 | }
44 | #endif
45 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/control_msgs/JointTrajectoryGoal.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_control_msgs_JointTrajectoryGoal_h
2 | #define _ROS_control_msgs_JointTrajectoryGoal_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "trajectory_msgs/JointTrajectory.h"
9 |
10 | namespace control_msgs
11 | {
12 |
13 | class JointTrajectoryGoal : public ros::Msg
14 | {
15 | public:
16 | typedef trajectory_msgs::JointTrajectory _trajectory_type;
17 | _trajectory_type trajectory;
18 |
19 | JointTrajectoryGoal():
20 | trajectory()
21 | {
22 | }
23 |
24 | virtual int serialize(unsigned char *outbuffer) const
25 | {
26 | int offset = 0;
27 | offset += this->trajectory.serialize(outbuffer + offset);
28 | return offset;
29 | }
30 |
31 | virtual int deserialize(unsigned char *inbuffer)
32 | {
33 | int offset = 0;
34 | offset += this->trajectory.deserialize(inbuffer + offset);
35 | return offset;
36 | }
37 |
38 | const char * getType(){ return "control_msgs/JointTrajectoryGoal"; };
39 | const char * getMD5(){ return "2a0eff76c870e8595636c2a562ca298e"; };
40 |
41 | };
42 |
43 | }
44 | #endif
45 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/jsk_footstep_msgs/PlanFootstepsResult.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_jsk_footstep_msgs_PlanFootstepsResult_h
2 | #define _ROS_jsk_footstep_msgs_PlanFootstepsResult_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "jsk_footstep_msgs/FootstepArray.h"
9 |
10 | namespace jsk_footstep_msgs
11 | {
12 |
13 | class PlanFootstepsResult : public ros::Msg
14 | {
15 | public:
16 | typedef jsk_footstep_msgs::FootstepArray _result_type;
17 | _result_type result;
18 |
19 | PlanFootstepsResult():
20 | result()
21 | {
22 | }
23 |
24 | virtual int serialize(unsigned char *outbuffer) const
25 | {
26 | int offset = 0;
27 | offset += this->result.serialize(outbuffer + offset);
28 | return offset;
29 | }
30 |
31 | virtual int deserialize(unsigned char *inbuffer)
32 | {
33 | int offset = 0;
34 | offset += this->result.deserialize(inbuffer + offset);
35 | return offset;
36 | }
37 |
38 | const char * getType(){ return "jsk_footstep_msgs/PlanFootstepsResult"; };
39 | const char * getMD5(){ return "951c674749b5b8b08d5eba2e3e62aedd"; };
40 |
41 | };
42 |
43 | }
44 | #endif
45 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/moveit_msgs/ExecuteTrajectoryGoal.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_moveit_msgs_ExecuteTrajectoryGoal_h
2 | #define _ROS_moveit_msgs_ExecuteTrajectoryGoal_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "moveit_msgs/RobotTrajectory.h"
9 |
10 | namespace moveit_msgs
11 | {
12 |
13 | class ExecuteTrajectoryGoal : public ros::Msg
14 | {
15 | public:
16 | typedef moveit_msgs::RobotTrajectory _trajectory_type;
17 | _trajectory_type trajectory;
18 |
19 | ExecuteTrajectoryGoal():
20 | trajectory()
21 | {
22 | }
23 |
24 | virtual int serialize(unsigned char *outbuffer) const
25 | {
26 | int offset = 0;
27 | offset += this->trajectory.serialize(outbuffer + offset);
28 | return offset;
29 | }
30 |
31 | virtual int deserialize(unsigned char *inbuffer)
32 | {
33 | int offset = 0;
34 | offset += this->trajectory.deserialize(inbuffer + offset);
35 | return offset;
36 | }
37 |
38 | const char * getType(){ return "moveit_msgs/ExecuteTrajectoryGoal"; };
39 | const char * getMD5(){ return "054c09e62210d7faad2f9fffdad07b57"; };
40 |
41 | };
42 |
43 | }
44 | #endif
45 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/examples/ADC/ADC.pde:
--------------------------------------------------------------------------------
1 | /*
2 | * rosserial ADC Example
3 | *
4 | * This is a poor man's Oscilloscope. It does not have the sampling
5 | * rate or accuracy of a commerical scope, but it is great to get
6 | * an analog value into ROS in a pinch.
7 | */
8 |
9 | #if (ARDUINO >= 100)
10 | #include
11 | #else
12 | #include
13 | #endif
14 | #include
15 | #include
16 |
17 | ros::NodeHandle nh;
18 |
19 | rosserial_arduino::Adc adc_msg;
20 | ros::Publisher p("adc", &adc_msg);
21 |
22 | void setup()
23 | {
24 | pinMode(13, OUTPUT);
25 | nh.initNode();
26 |
27 | nh.advertise(p);
28 | }
29 |
30 | //We average the analog reading to elminate some of the noise
31 | int averageAnalog(int pin){
32 | int v=0;
33 | for(int i=0; i<4; i++) v+= analogRead(pin);
34 | return v/4;
35 | }
36 |
37 | long adc_timer;
38 |
39 | void loop()
40 | {
41 | adc_msg.adc0 = averageAnalog(0);
42 | adc_msg.adc1 = averageAnalog(1);
43 | adc_msg.adc2 = averageAnalog(2);
44 | adc_msg.adc3 = averageAnalog(3);
45 | adc_msg.adc4 = averageAnalog(4);
46 | adc_msg.adc5 = averageAnalog(5);
47 |
48 | p.publish(&adc_msg);
49 |
50 | nh.spinOnce();
51 | }
52 |
53 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/examples/TcpBlink/TcpBlink.ino:
--------------------------------------------------------------------------------
1 | /*
2 | * rosserial Subscriber Example using TCP on Arduino Shield (Wiznet W5100 based)
3 | * Blinks an LED on callback
4 | */
5 | #include
6 | #include
7 |
8 | #define ROSSERIAL_ARDUINO_TCP
9 |
10 | #include
11 | #include
12 |
13 | ros::NodeHandle nh;
14 |
15 | // Shield settings
16 | byte mac[] = { 0xDE, 0xAD, 0xBE, 0xEF, 0xFE, 0xED };
17 | IPAddress ip(192, 168, 0, 177);
18 |
19 | // Server settings
20 | IPAddress server(192, 168, 0, 11);
21 | uint16_t serverPort = 11411;
22 |
23 | const uint8_t ledPin = 6; // 13 already used for SPI connection with the shield
24 |
25 | void messageCb( const std_msgs::Empty&){
26 | digitalWrite(ledPin, HIGH-digitalRead(ledPin)); // blink the led
27 | }
28 |
29 | ros::Subscriber sub("toggle_led", &messageCb );
30 |
31 | void setup()
32 | {
33 | Ethernet.begin(mac, ip);
34 | // give the Ethernet shield a second to initialize:
35 | delay(1000);
36 | pinMode(ledPin, OUTPUT);
37 | nh.getHardware()->setConnection(server, serverPort);
38 | nh.initNode();
39 | nh.subscribe(sub);
40 | }
41 |
42 | void loop()
43 | {
44 | nh.spinOnce();
45 | delay(1);
46 | }
47 |
48 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/moveit_msgs/ExecuteTrajectoryResult.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_moveit_msgs_ExecuteTrajectoryResult_h
2 | #define _ROS_moveit_msgs_ExecuteTrajectoryResult_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "moveit_msgs/MoveItErrorCodes.h"
9 |
10 | namespace moveit_msgs
11 | {
12 |
13 | class ExecuteTrajectoryResult : public ros::Msg
14 | {
15 | public:
16 | typedef moveit_msgs::MoveItErrorCodes _error_code_type;
17 | _error_code_type error_code;
18 |
19 | ExecuteTrajectoryResult():
20 | error_code()
21 | {
22 | }
23 |
24 | virtual int serialize(unsigned char *outbuffer) const
25 | {
26 | int offset = 0;
27 | offset += this->error_code.serialize(outbuffer + offset);
28 | return offset;
29 | }
30 |
31 | virtual int deserialize(unsigned char *inbuffer)
32 | {
33 | int offset = 0;
34 | offset += this->error_code.deserialize(inbuffer + offset);
35 | return offset;
36 | }
37 |
38 | const char * getType(){ return "moveit_msgs/ExecuteTrajectoryResult"; };
39 | const char * getMD5(){ return "1f7ab918f5d0c5312f25263d3d688122"; };
40 |
41 | };
42 |
43 | }
44 | #endif
45 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/moveit_msgs/MoveGroupSequenceResult.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_moveit_msgs_MoveGroupSequenceResult_h
2 | #define _ROS_moveit_msgs_MoveGroupSequenceResult_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "moveit_msgs/MotionSequenceResponse.h"
9 |
10 | namespace moveit_msgs
11 | {
12 |
13 | class MoveGroupSequenceResult : public ros::Msg
14 | {
15 | public:
16 | typedef moveit_msgs::MotionSequenceResponse _response_type;
17 | _response_type response;
18 |
19 | MoveGroupSequenceResult():
20 | response()
21 | {
22 | }
23 |
24 | virtual int serialize(unsigned char *outbuffer) const
25 | {
26 | int offset = 0;
27 | offset += this->response.serialize(outbuffer + offset);
28 | return offset;
29 | }
30 |
31 | virtual int deserialize(unsigned char *inbuffer)
32 | {
33 | int offset = 0;
34 | offset += this->response.deserialize(inbuffer + offset);
35 | return offset;
36 | }
37 |
38 | const char * getType(){ return "moveit_msgs/MoveGroupSequenceResult"; };
39 | const char * getMD5(){ return "039cee462ada3f0feb5f4e2e12baefae"; };
40 |
41 | };
42 |
43 | }
44 | #endif
45 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/jsk_footstep_msgs/PlanFootstepsFeedback.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_jsk_footstep_msgs_PlanFootstepsFeedback_h
2 | #define _ROS_jsk_footstep_msgs_PlanFootstepsFeedback_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "jsk_footstep_msgs/FootstepArray.h"
9 |
10 | namespace jsk_footstep_msgs
11 | {
12 |
13 | class PlanFootstepsFeedback : public ros::Msg
14 | {
15 | public:
16 | typedef jsk_footstep_msgs::FootstepArray _feedback_type;
17 | _feedback_type feedback;
18 |
19 | PlanFootstepsFeedback():
20 | feedback()
21 | {
22 | }
23 |
24 | virtual int serialize(unsigned char *outbuffer) const
25 | {
26 | int offset = 0;
27 | offset += this->feedback.serialize(outbuffer + offset);
28 | return offset;
29 | }
30 |
31 | virtual int deserialize(unsigned char *inbuffer)
32 | {
33 | int offset = 0;
34 | offset += this->feedback.deserialize(inbuffer + offset);
35 | return offset;
36 | }
37 |
38 | const char * getType(){ return "jsk_footstep_msgs/PlanFootstepsFeedback"; };
39 | const char * getMD5(){ return "5f4757afbf7a130712f963e49c7f5f00"; };
40 |
41 | };
42 |
43 | }
44 | #endif
45 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/std_msgs/UInt16.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_std_msgs_UInt16_h
2 | #define _ROS_std_msgs_UInt16_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace std_msgs
10 | {
11 |
12 | class UInt16 : public ros::Msg
13 | {
14 | public:
15 | typedef uint16_t _data_type;
16 | _data_type data;
17 |
18 | UInt16():
19 | data(0)
20 | {
21 | }
22 |
23 | virtual int serialize(unsigned char *outbuffer) const
24 | {
25 | int offset = 0;
26 | *(outbuffer + offset + 0) = (this->data >> (8 * 0)) & 0xFF;
27 | *(outbuffer + offset + 1) = (this->data >> (8 * 1)) & 0xFF;
28 | offset += sizeof(this->data);
29 | return offset;
30 | }
31 |
32 | virtual int deserialize(unsigned char *inbuffer)
33 | {
34 | int offset = 0;
35 | this->data = ((uint16_t) (*(inbuffer + offset)));
36 | this->data |= ((uint16_t) (*(inbuffer + offset + 1))) << (8 * 1);
37 | offset += sizeof(this->data);
38 | return offset;
39 | }
40 |
41 | const char * getType(){ return "std_msgs/UInt16"; };
42 | const char * getMD5(){ return "1df79edf208b629fe6b81923a544552d"; };
43 |
44 | };
45 |
46 | }
47 | #endif
48 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/turtlebot3_msgs/Sound.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_turtlebot3_msgs_Sound_h
2 | #define _ROS_turtlebot3_msgs_Sound_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace turtlebot3_msgs
10 | {
11 |
12 | class Sound : public ros::Msg
13 | {
14 | public:
15 | typedef uint8_t _value_type;
16 | _value_type value;
17 | enum { OFF = 0 };
18 | enum { ON = 1 };
19 | enum { LOW_BATTERY = 2 };
20 | enum { ERROR = 3 };
21 | enum { BUTTON1 = 4 };
22 | enum { BUTTON2 = 5 };
23 |
24 | Sound():
25 | value(0)
26 | {
27 | }
28 |
29 | virtual int serialize(unsigned char *outbuffer) const
30 | {
31 | int offset = 0;
32 | *(outbuffer + offset + 0) = (this->value >> (8 * 0)) & 0xFF;
33 | offset += sizeof(this->value);
34 | return offset;
35 | }
36 |
37 | virtual int deserialize(unsigned char *inbuffer)
38 | {
39 | int offset = 0;
40 | this->value = ((uint8_t) (*(inbuffer + offset)));
41 | offset += sizeof(this->value);
42 | return offset;
43 | }
44 |
45 | const char * getType(){ return "turtlebot3_msgs/Sound"; };
46 | const char * getMD5(){ return "e1f8c7f8a9a61383b5734fbdeca2f99a"; };
47 |
48 | };
49 |
50 | }
51 | #endif
52 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/geometry_msgs/Wrench.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_geometry_msgs_Wrench_h
2 | #define _ROS_geometry_msgs_Wrench_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "geometry_msgs/Vector3.h"
9 |
10 | namespace geometry_msgs
11 | {
12 |
13 | class Wrench : public ros::Msg
14 | {
15 | public:
16 | typedef geometry_msgs::Vector3 _force_type;
17 | _force_type force;
18 | typedef geometry_msgs::Vector3 _torque_type;
19 | _torque_type torque;
20 |
21 | Wrench():
22 | force(),
23 | torque()
24 | {
25 | }
26 |
27 | virtual int serialize(unsigned char *outbuffer) const
28 | {
29 | int offset = 0;
30 | offset += this->force.serialize(outbuffer + offset);
31 | offset += this->torque.serialize(outbuffer + offset);
32 | return offset;
33 | }
34 |
35 | virtual int deserialize(unsigned char *inbuffer)
36 | {
37 | int offset = 0;
38 | offset += this->force.deserialize(inbuffer + offset);
39 | offset += this->torque.deserialize(inbuffer + offset);
40 | return offset;
41 | }
42 |
43 | const char * getType(){ return "geometry_msgs/Wrench"; };
44 | const char * getMD5(){ return "4f539cf138b23283b520fd271b567936"; };
45 |
46 | };
47 |
48 | }
49 | #endif
50 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/geometry_msgs/Accel.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_geometry_msgs_Accel_h
2 | #define _ROS_geometry_msgs_Accel_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "geometry_msgs/Vector3.h"
9 |
10 | namespace geometry_msgs
11 | {
12 |
13 | class Accel : public ros::Msg
14 | {
15 | public:
16 | typedef geometry_msgs::Vector3 _linear_type;
17 | _linear_type linear;
18 | typedef geometry_msgs::Vector3 _angular_type;
19 | _angular_type angular;
20 |
21 | Accel():
22 | linear(),
23 | angular()
24 | {
25 | }
26 |
27 | virtual int serialize(unsigned char *outbuffer) const
28 | {
29 | int offset = 0;
30 | offset += this->linear.serialize(outbuffer + offset);
31 | offset += this->angular.serialize(outbuffer + offset);
32 | return offset;
33 | }
34 |
35 | virtual int deserialize(unsigned char *inbuffer)
36 | {
37 | int offset = 0;
38 | offset += this->linear.deserialize(inbuffer + offset);
39 | offset += this->angular.deserialize(inbuffer + offset);
40 | return offset;
41 | }
42 |
43 | const char * getType(){ return "geometry_msgs/Accel"; };
44 | const char * getMD5(){ return "9f195f881246fdfa2798d1d3eebca84a"; };
45 |
46 | };
47 |
48 | }
49 | #endif
50 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/geometry_msgs/Twist.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_geometry_msgs_Twist_h
2 | #define _ROS_geometry_msgs_Twist_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "geometry_msgs/Vector3.h"
9 |
10 | namespace geometry_msgs
11 | {
12 |
13 | class Twist : public ros::Msg
14 | {
15 | public:
16 | typedef geometry_msgs::Vector3 _linear_type;
17 | _linear_type linear;
18 | typedef geometry_msgs::Vector3 _angular_type;
19 | _angular_type angular;
20 |
21 | Twist():
22 | linear(),
23 | angular()
24 | {
25 | }
26 |
27 | virtual int serialize(unsigned char *outbuffer) const
28 | {
29 | int offset = 0;
30 | offset += this->linear.serialize(outbuffer + offset);
31 | offset += this->angular.serialize(outbuffer + offset);
32 | return offset;
33 | }
34 |
35 | virtual int deserialize(unsigned char *inbuffer)
36 | {
37 | int offset = 0;
38 | offset += this->linear.deserialize(inbuffer + offset);
39 | offset += this->angular.deserialize(inbuffer + offset);
40 | return offset;
41 | }
42 |
43 | const char * getType(){ return "geometry_msgs/Twist"; };
44 | const char * getMD5(){ return "9f195f881246fdfa2798d1d3eebca84a"; };
45 |
46 | };
47 |
48 | }
49 | #endif
50 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/object_recognition_msgs/ObjectRecognitionResult.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_object_recognition_msgs_ObjectRecognitionResult_h
2 | #define _ROS_object_recognition_msgs_ObjectRecognitionResult_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "object_recognition_msgs/RecognizedObjectArray.h"
9 |
10 | namespace object_recognition_msgs
11 | {
12 |
13 | class ObjectRecognitionResult : public ros::Msg
14 | {
15 | public:
16 | typedef object_recognition_msgs::RecognizedObjectArray _recognized_objects_type;
17 | _recognized_objects_type recognized_objects;
18 |
19 | ObjectRecognitionResult():
20 | recognized_objects()
21 | {
22 | }
23 |
24 | virtual int serialize(unsigned char *outbuffer) const
25 | {
26 | int offset = 0;
27 | offset += this->recognized_objects.serialize(outbuffer + offset);
28 | return offset;
29 | }
30 |
31 | virtual int deserialize(unsigned char *inbuffer)
32 | {
33 | int offset = 0;
34 | offset += this->recognized_objects.deserialize(inbuffer + offset);
35 | return offset;
36 | }
37 |
38 | const char * getType(){ return "object_recognition_msgs/ObjectRecognitionResult"; };
39 | const char * getMD5(){ return "868e41288f9f8636e2b6c51f1af6aa9c"; };
40 |
41 | };
42 |
43 | }
44 | #endif
45 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/geometry_msgs/PoseStamped.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_geometry_msgs_PoseStamped_h
2 | #define _ROS_geometry_msgs_PoseStamped_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "std_msgs/Header.h"
9 | #include "geometry_msgs/Pose.h"
10 |
11 | namespace geometry_msgs
12 | {
13 |
14 | class PoseStamped : public ros::Msg
15 | {
16 | public:
17 | typedef std_msgs::Header _header_type;
18 | _header_type header;
19 | typedef geometry_msgs::Pose _pose_type;
20 | _pose_type pose;
21 |
22 | PoseStamped():
23 | header(),
24 | pose()
25 | {
26 | }
27 |
28 | virtual int serialize(unsigned char *outbuffer) const
29 | {
30 | int offset = 0;
31 | offset += this->header.serialize(outbuffer + offset);
32 | offset += this->pose.serialize(outbuffer + offset);
33 | return offset;
34 | }
35 |
36 | virtual int deserialize(unsigned char *inbuffer)
37 | {
38 | int offset = 0;
39 | offset += this->header.deserialize(inbuffer + offset);
40 | offset += this->pose.deserialize(inbuffer + offset);
41 | return offset;
42 | }
43 |
44 | const char * getType(){ return "geometry_msgs/PoseStamped"; };
45 | const char * getMD5(){ return "d3812c3cbc69362b77dc0b19b345f8f5"; };
46 |
47 | };
48 |
49 | }
50 | #endif
51 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/std_msgs/Bool.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_std_msgs_Bool_h
2 | #define _ROS_std_msgs_Bool_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace std_msgs
10 | {
11 |
12 | class Bool : public ros::Msg
13 | {
14 | public:
15 | typedef bool _data_type;
16 | _data_type data;
17 |
18 | Bool():
19 | data(0)
20 | {
21 | }
22 |
23 | virtual int serialize(unsigned char *outbuffer) const
24 | {
25 | int offset = 0;
26 | union {
27 | bool real;
28 | uint8_t base;
29 | } u_data;
30 | u_data.real = this->data;
31 | *(outbuffer + offset + 0) = (u_data.base >> (8 * 0)) & 0xFF;
32 | offset += sizeof(this->data);
33 | return offset;
34 | }
35 |
36 | virtual int deserialize(unsigned char *inbuffer)
37 | {
38 | int offset = 0;
39 | union {
40 | bool real;
41 | uint8_t base;
42 | } u_data;
43 | u_data.base = 0;
44 | u_data.base |= ((uint8_t) (*(inbuffer + offset + 0))) << (8 * 0);
45 | this->data = u_data.real;
46 | offset += sizeof(this->data);
47 | return offset;
48 | }
49 |
50 | const char * getType(){ return "std_msgs/Bool"; };
51 | const char * getMD5(){ return "8b94c1b53db61fb6aed406028ad6332a"; };
52 |
53 | };
54 |
55 | }
56 | #endif
57 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/geographic_msgs/BoundingBox.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_geographic_msgs_BoundingBox_h
2 | #define _ROS_geographic_msgs_BoundingBox_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "geographic_msgs/GeoPoint.h"
9 |
10 | namespace geographic_msgs
11 | {
12 |
13 | class BoundingBox : public ros::Msg
14 | {
15 | public:
16 | typedef geographic_msgs::GeoPoint _min_pt_type;
17 | _min_pt_type min_pt;
18 | typedef geographic_msgs::GeoPoint _max_pt_type;
19 | _max_pt_type max_pt;
20 |
21 | BoundingBox():
22 | min_pt(),
23 | max_pt()
24 | {
25 | }
26 |
27 | virtual int serialize(unsigned char *outbuffer) const
28 | {
29 | int offset = 0;
30 | offset += this->min_pt.serialize(outbuffer + offset);
31 | offset += this->max_pt.serialize(outbuffer + offset);
32 | return offset;
33 | }
34 |
35 | virtual int deserialize(unsigned char *inbuffer)
36 | {
37 | int offset = 0;
38 | offset += this->min_pt.deserialize(inbuffer + offset);
39 | offset += this->max_pt.deserialize(inbuffer + offset);
40 | return offset;
41 | }
42 |
43 | const char * getType(){ return "geographic_msgs/BoundingBox"; };
44 | const char * getMD5(){ return "f62e8b5e390a3ac7603250d46e8f8446"; };
45 |
46 | };
47 |
48 | }
49 | #endif
50 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/std_msgs/Byte.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_std_msgs_Byte_h
2 | #define _ROS_std_msgs_Byte_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace std_msgs
10 | {
11 |
12 | class Byte : public ros::Msg
13 | {
14 | public:
15 | typedef int8_t _data_type;
16 | _data_type data;
17 |
18 | Byte():
19 | data(0)
20 | {
21 | }
22 |
23 | virtual int serialize(unsigned char *outbuffer) const
24 | {
25 | int offset = 0;
26 | union {
27 | int8_t real;
28 | uint8_t base;
29 | } u_data;
30 | u_data.real = this->data;
31 | *(outbuffer + offset + 0) = (u_data.base >> (8 * 0)) & 0xFF;
32 | offset += sizeof(this->data);
33 | return offset;
34 | }
35 |
36 | virtual int deserialize(unsigned char *inbuffer)
37 | {
38 | int offset = 0;
39 | union {
40 | int8_t real;
41 | uint8_t base;
42 | } u_data;
43 | u_data.base = 0;
44 | u_data.base |= ((uint8_t) (*(inbuffer + offset + 0))) << (8 * 0);
45 | this->data = u_data.real;
46 | offset += sizeof(this->data);
47 | return offset;
48 | }
49 |
50 | const char * getType(){ return "std_msgs/Byte"; };
51 | const char * getMD5(){ return "ad736a2e8818154c487bb80fe42ce43b"; };
52 |
53 | };
54 |
55 | }
56 | #endif
57 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/std_msgs/Int8.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_std_msgs_Int8_h
2 | #define _ROS_std_msgs_Int8_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace std_msgs
10 | {
11 |
12 | class Int8 : public ros::Msg
13 | {
14 | public:
15 | typedef int8_t _data_type;
16 | _data_type data;
17 |
18 | Int8():
19 | data(0)
20 | {
21 | }
22 |
23 | virtual int serialize(unsigned char *outbuffer) const
24 | {
25 | int offset = 0;
26 | union {
27 | int8_t real;
28 | uint8_t base;
29 | } u_data;
30 | u_data.real = this->data;
31 | *(outbuffer + offset + 0) = (u_data.base >> (8 * 0)) & 0xFF;
32 | offset += sizeof(this->data);
33 | return offset;
34 | }
35 |
36 | virtual int deserialize(unsigned char *inbuffer)
37 | {
38 | int offset = 0;
39 | union {
40 | int8_t real;
41 | uint8_t base;
42 | } u_data;
43 | u_data.base = 0;
44 | u_data.base |= ((uint8_t) (*(inbuffer + offset + 0))) << (8 * 0);
45 | this->data = u_data.real;
46 | offset += sizeof(this->data);
47 | return offset;
48 | }
49 |
50 | const char * getType(){ return "std_msgs/Int8"; };
51 | const char * getMD5(){ return "27ffa0c9c4b8fb8492252bcad9e5c57b"; };
52 |
53 | };
54 |
55 | }
56 | #endif
57 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/geometry_msgs/AccelStamped.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_geometry_msgs_AccelStamped_h
2 | #define _ROS_geometry_msgs_AccelStamped_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "std_msgs/Header.h"
9 | #include "geometry_msgs/Accel.h"
10 |
11 | namespace geometry_msgs
12 | {
13 |
14 | class AccelStamped : public ros::Msg
15 | {
16 | public:
17 | typedef std_msgs::Header _header_type;
18 | _header_type header;
19 | typedef geometry_msgs::Accel _accel_type;
20 | _accel_type accel;
21 |
22 | AccelStamped():
23 | header(),
24 | accel()
25 | {
26 | }
27 |
28 | virtual int serialize(unsigned char *outbuffer) const
29 | {
30 | int offset = 0;
31 | offset += this->header.serialize(outbuffer + offset);
32 | offset += this->accel.serialize(outbuffer + offset);
33 | return offset;
34 | }
35 |
36 | virtual int deserialize(unsigned char *inbuffer)
37 | {
38 | int offset = 0;
39 | offset += this->header.deserialize(inbuffer + offset);
40 | offset += this->accel.deserialize(inbuffer + offset);
41 | return offset;
42 | }
43 |
44 | const char * getType(){ return "geometry_msgs/AccelStamped"; };
45 | const char * getMD5(){ return "d8a98a5d81351b6eb0578c78557e7659"; };
46 |
47 | };
48 |
49 | }
50 | #endif
51 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/geometry_msgs/PointStamped.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_geometry_msgs_PointStamped_h
2 | #define _ROS_geometry_msgs_PointStamped_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "std_msgs/Header.h"
9 | #include "geometry_msgs/Point.h"
10 |
11 | namespace geometry_msgs
12 | {
13 |
14 | class PointStamped : public ros::Msg
15 | {
16 | public:
17 | typedef std_msgs::Header _header_type;
18 | _header_type header;
19 | typedef geometry_msgs::Point _point_type;
20 | _point_type point;
21 |
22 | PointStamped():
23 | header(),
24 | point()
25 | {
26 | }
27 |
28 | virtual int serialize(unsigned char *outbuffer) const
29 | {
30 | int offset = 0;
31 | offset += this->header.serialize(outbuffer + offset);
32 | offset += this->point.serialize(outbuffer + offset);
33 | return offset;
34 | }
35 |
36 | virtual int deserialize(unsigned char *inbuffer)
37 | {
38 | int offset = 0;
39 | offset += this->header.deserialize(inbuffer + offset);
40 | offset += this->point.deserialize(inbuffer + offset);
41 | return offset;
42 | }
43 |
44 | const char * getType(){ return "geometry_msgs/PointStamped"; };
45 | const char * getMD5(){ return "c63aecb41bfdfd6b7e1fac37c7cbe7bf"; };
46 |
47 | };
48 |
49 | }
50 | #endif
51 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/geometry_msgs/TwistStamped.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_geometry_msgs_TwistStamped_h
2 | #define _ROS_geometry_msgs_TwistStamped_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "std_msgs/Header.h"
9 | #include "geometry_msgs/Twist.h"
10 |
11 | namespace geometry_msgs
12 | {
13 |
14 | class TwistStamped : public ros::Msg
15 | {
16 | public:
17 | typedef std_msgs::Header _header_type;
18 | _header_type header;
19 | typedef geometry_msgs::Twist _twist_type;
20 | _twist_type twist;
21 |
22 | TwistStamped():
23 | header(),
24 | twist()
25 | {
26 | }
27 |
28 | virtual int serialize(unsigned char *outbuffer) const
29 | {
30 | int offset = 0;
31 | offset += this->header.serialize(outbuffer + offset);
32 | offset += this->twist.serialize(outbuffer + offset);
33 | return offset;
34 | }
35 |
36 | virtual int deserialize(unsigned char *inbuffer)
37 | {
38 | int offset = 0;
39 | offset += this->header.deserialize(inbuffer + offset);
40 | offset += this->twist.deserialize(inbuffer + offset);
41 | return offset;
42 | }
43 |
44 | const char * getType(){ return "geometry_msgs/TwistStamped"; };
45 | const char * getMD5(){ return "98d34b0043a2093cf9d9345ab6eef12e"; };
46 |
47 | };
48 |
49 | }
50 | #endif
51 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/people_msgs/PersonStamped.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_people_msgs_PersonStamped_h
2 | #define _ROS_people_msgs_PersonStamped_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "std_msgs/Header.h"
9 | #include "people_msgs/Person.h"
10 |
11 | namespace people_msgs
12 | {
13 |
14 | class PersonStamped : public ros::Msg
15 | {
16 | public:
17 | typedef std_msgs::Header _header_type;
18 | _header_type header;
19 | typedef people_msgs::Person _person_type;
20 | _person_type person;
21 |
22 | PersonStamped():
23 | header(),
24 | person()
25 | {
26 | }
27 |
28 | virtual int serialize(unsigned char *outbuffer) const
29 | {
30 | int offset = 0;
31 | offset += this->header.serialize(outbuffer + offset);
32 | offset += this->person.serialize(outbuffer + offset);
33 | return offset;
34 | }
35 |
36 | virtual int deserialize(unsigned char *inbuffer)
37 | {
38 | int offset = 0;
39 | offset += this->header.deserialize(inbuffer + offset);
40 | offset += this->person.deserialize(inbuffer + offset);
41 | return offset;
42 | }
43 |
44 | const char * getType(){ return "people_msgs/PersonStamped"; };
45 | const char * getMD5(){ return "4a352a8b709eb9fec941a4f0f42651e7"; };
46 |
47 | };
48 |
49 | }
50 | #endif
51 |
--------------------------------------------------------------------------------
/LICENSE:
--------------------------------------------------------------------------------
1 | BSD 2-Clause License
2 |
3 | Copyright (c) 2021, maHidaka
4 | All rights reserved.
5 |
6 | Redistribution and use in source and binary forms, with or without
7 | modification, are permitted provided that the following conditions are met:
8 |
9 | 1. Redistributions of source code must retain the above copyright notice, this
10 | list of conditions and the following disclaimer.
11 |
12 | 2. Redistributions in binary form must reproduce the above copyright notice,
13 | this list of conditions and the following disclaimer in the documentation
14 | and/or other materials provided with the distribution.
15 |
16 | THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS"
17 | AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE
18 | IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE
19 | DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR CONTRIBUTORS BE LIABLE
20 | FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL
21 | DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR
22 | SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER
23 | CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY,
24 | OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE
25 | OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
26 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/control_msgs/GripperCommand.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_control_msgs_GripperCommand_h
2 | #define _ROS_control_msgs_GripperCommand_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 |
9 | namespace control_msgs
10 | {
11 |
12 | class GripperCommand : public ros::Msg
13 | {
14 | public:
15 | typedef float _position_type;
16 | _position_type position;
17 | typedef float _max_effort_type;
18 | _max_effort_type max_effort;
19 |
20 | GripperCommand():
21 | position(0),
22 | max_effort(0)
23 | {
24 | }
25 |
26 | virtual int serialize(unsigned char *outbuffer) const
27 | {
28 | int offset = 0;
29 | offset += serializeAvrFloat64(outbuffer + offset, this->position);
30 | offset += serializeAvrFloat64(outbuffer + offset, this->max_effort);
31 | return offset;
32 | }
33 |
34 | virtual int deserialize(unsigned char *inbuffer)
35 | {
36 | int offset = 0;
37 | offset += deserializeAvrFloat64(inbuffer + offset, &(this->position));
38 | offset += deserializeAvrFloat64(inbuffer + offset, &(this->max_effort));
39 | return offset;
40 | }
41 |
42 | const char * getType(){ return "control_msgs/GripperCommand"; };
43 | const char * getMD5(){ return "680acaff79486f017132a7f198d40f08"; };
44 |
45 | };
46 |
47 | }
48 | #endif
49 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/geometry_msgs/WrenchStamped.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_geometry_msgs_WrenchStamped_h
2 | #define _ROS_geometry_msgs_WrenchStamped_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "std_msgs/Header.h"
9 | #include "geometry_msgs/Wrench.h"
10 |
11 | namespace geometry_msgs
12 | {
13 |
14 | class WrenchStamped : public ros::Msg
15 | {
16 | public:
17 | typedef std_msgs::Header _header_type;
18 | _header_type header;
19 | typedef geometry_msgs::Wrench _wrench_type;
20 | _wrench_type wrench;
21 |
22 | WrenchStamped():
23 | header(),
24 | wrench()
25 | {
26 | }
27 |
28 | virtual int serialize(unsigned char *outbuffer) const
29 | {
30 | int offset = 0;
31 | offset += this->header.serialize(outbuffer + offset);
32 | offset += this->wrench.serialize(outbuffer + offset);
33 | return offset;
34 | }
35 |
36 | virtual int deserialize(unsigned char *inbuffer)
37 | {
38 | int offset = 0;
39 | offset += this->header.deserialize(inbuffer + offset);
40 | offset += this->wrench.deserialize(inbuffer + offset);
41 | return offset;
42 | }
43 |
44 | const char * getType(){ return "geometry_msgs/WrenchStamped"; };
45 | const char * getMD5(){ return "d78d3cb249ce23087ade7e7d0c40cfa7"; };
46 |
47 | };
48 |
49 | }
50 | #endif
51 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/geometry_msgs/Pose.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_geometry_msgs_Pose_h
2 | #define _ROS_geometry_msgs_Pose_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "geometry_msgs/Point.h"
9 | #include "geometry_msgs/Quaternion.h"
10 |
11 | namespace geometry_msgs
12 | {
13 |
14 | class Pose : public ros::Msg
15 | {
16 | public:
17 | typedef geometry_msgs::Point _position_type;
18 | _position_type position;
19 | typedef geometry_msgs::Quaternion _orientation_type;
20 | _orientation_type orientation;
21 |
22 | Pose():
23 | position(),
24 | orientation()
25 | {
26 | }
27 |
28 | virtual int serialize(unsigned char *outbuffer) const
29 | {
30 | int offset = 0;
31 | offset += this->position.serialize(outbuffer + offset);
32 | offset += this->orientation.serialize(outbuffer + offset);
33 | return offset;
34 | }
35 |
36 | virtual int deserialize(unsigned char *inbuffer)
37 | {
38 | int offset = 0;
39 | offset += this->position.deserialize(inbuffer + offset);
40 | offset += this->orientation.deserialize(inbuffer + offset);
41 | return offset;
42 | }
43 |
44 | const char * getType(){ return "geometry_msgs/Pose"; };
45 | const char * getMD5(){ return "e45d45a5a1ce597b249e23fb30fc871f"; };
46 |
47 | };
48 |
49 | }
50 | #endif
51 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/geographic_msgs/GeoPoseStamped.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_geographic_msgs_GeoPoseStamped_h
2 | #define _ROS_geographic_msgs_GeoPoseStamped_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "std_msgs/Header.h"
9 | #include "geographic_msgs/GeoPose.h"
10 |
11 | namespace geographic_msgs
12 | {
13 |
14 | class GeoPoseStamped : public ros::Msg
15 | {
16 | public:
17 | typedef std_msgs::Header _header_type;
18 | _header_type header;
19 | typedef geographic_msgs::GeoPose _pose_type;
20 | _pose_type pose;
21 |
22 | GeoPoseStamped():
23 | header(),
24 | pose()
25 | {
26 | }
27 |
28 | virtual int serialize(unsigned char *outbuffer) const
29 | {
30 | int offset = 0;
31 | offset += this->header.serialize(outbuffer + offset);
32 | offset += this->pose.serialize(outbuffer + offset);
33 | return offset;
34 | }
35 |
36 | virtual int deserialize(unsigned char *inbuffer)
37 | {
38 | int offset = 0;
39 | offset += this->header.deserialize(inbuffer + offset);
40 | offset += this->pose.deserialize(inbuffer + offset);
41 | return offset;
42 | }
43 |
44 | const char * getType(){ return "geographic_msgs/GeoPoseStamped"; };
45 | const char * getMD5(){ return "cc409c8ed6064d8a846fa207bf3fba6b"; };
46 |
47 | };
48 |
49 | }
50 | #endif
51 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/geometry_msgs/Vector3Stamped.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_geometry_msgs_Vector3Stamped_h
2 | #define _ROS_geometry_msgs_Vector3Stamped_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "std_msgs/Header.h"
9 | #include "geometry_msgs/Vector3.h"
10 |
11 | namespace geometry_msgs
12 | {
13 |
14 | class Vector3Stamped : public ros::Msg
15 | {
16 | public:
17 | typedef std_msgs::Header _header_type;
18 | _header_type header;
19 | typedef geometry_msgs::Vector3 _vector_type;
20 | _vector_type vector;
21 |
22 | Vector3Stamped():
23 | header(),
24 | vector()
25 | {
26 | }
27 |
28 | virtual int serialize(unsigned char *outbuffer) const
29 | {
30 | int offset = 0;
31 | offset += this->header.serialize(outbuffer + offset);
32 | offset += this->vector.serialize(outbuffer + offset);
33 | return offset;
34 | }
35 |
36 | virtual int deserialize(unsigned char *inbuffer)
37 | {
38 | int offset = 0;
39 | offset += this->header.deserialize(inbuffer + offset);
40 | offset += this->vector.deserialize(inbuffer + offset);
41 | return offset;
42 | }
43 |
44 | const char * getType(){ return "geometry_msgs/Vector3Stamped"; };
45 | const char * getMD5(){ return "7b324c7325e683bf02a9b14b01090ec7"; };
46 |
47 | };
48 |
49 | }
50 | #endif
51 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/geometry_msgs/InertiaStamped.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_geometry_msgs_InertiaStamped_h
2 | #define _ROS_geometry_msgs_InertiaStamped_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "std_msgs/Header.h"
9 | #include "geometry_msgs/Inertia.h"
10 |
11 | namespace geometry_msgs
12 | {
13 |
14 | class InertiaStamped : public ros::Msg
15 | {
16 | public:
17 | typedef std_msgs::Header _header_type;
18 | _header_type header;
19 | typedef geometry_msgs::Inertia _inertia_type;
20 | _inertia_type inertia;
21 |
22 | InertiaStamped():
23 | header(),
24 | inertia()
25 | {
26 | }
27 |
28 | virtual int serialize(unsigned char *outbuffer) const
29 | {
30 | int offset = 0;
31 | offset += this->header.serialize(outbuffer + offset);
32 | offset += this->inertia.serialize(outbuffer + offset);
33 | return offset;
34 | }
35 |
36 | virtual int deserialize(unsigned char *inbuffer)
37 | {
38 | int offset = 0;
39 | offset += this->header.deserialize(inbuffer + offset);
40 | offset += this->inertia.deserialize(inbuffer + offset);
41 | return offset;
42 | }
43 |
44 | const char * getType(){ return "geometry_msgs/InertiaStamped"; };
45 | const char * getMD5(){ return "ddee48caeab5a966c5e8d166654a9ac7"; };
46 |
47 | };
48 |
49 | }
50 | #endif
51 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/geometry_msgs/PolygonStamped.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_geometry_msgs_PolygonStamped_h
2 | #define _ROS_geometry_msgs_PolygonStamped_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "std_msgs/Header.h"
9 | #include "geometry_msgs/Polygon.h"
10 |
11 | namespace geometry_msgs
12 | {
13 |
14 | class PolygonStamped : public ros::Msg
15 | {
16 | public:
17 | typedef std_msgs::Header _header_type;
18 | _header_type header;
19 | typedef geometry_msgs::Polygon _polygon_type;
20 | _polygon_type polygon;
21 |
22 | PolygonStamped():
23 | header(),
24 | polygon()
25 | {
26 | }
27 |
28 | virtual int serialize(unsigned char *outbuffer) const
29 | {
30 | int offset = 0;
31 | offset += this->header.serialize(outbuffer + offset);
32 | offset += this->polygon.serialize(outbuffer + offset);
33 | return offset;
34 | }
35 |
36 | virtual int deserialize(unsigned char *inbuffer)
37 | {
38 | int offset = 0;
39 | offset += this->header.deserialize(inbuffer + offset);
40 | offset += this->polygon.deserialize(inbuffer + offset);
41 | return offset;
42 | }
43 |
44 | const char * getType(){ return "geometry_msgs/PolygonStamped"; };
45 | const char * getMD5(){ return "c6be8f7dc3bee7fe9e8d296070f53340"; };
46 |
47 | };
48 |
49 | }
50 | #endif
51 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/jsk_recognition_msgs/Segment.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_jsk_recognition_msgs_Segment_h
2 | #define _ROS_jsk_recognition_msgs_Segment_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "geometry_msgs/Point.h"
9 |
10 | namespace jsk_recognition_msgs
11 | {
12 |
13 | class Segment : public ros::Msg
14 | {
15 | public:
16 | typedef geometry_msgs::Point _start_point_type;
17 | _start_point_type start_point;
18 | typedef geometry_msgs::Point _end_point_type;
19 | _end_point_type end_point;
20 |
21 | Segment():
22 | start_point(),
23 | end_point()
24 | {
25 | }
26 |
27 | virtual int serialize(unsigned char *outbuffer) const
28 | {
29 | int offset = 0;
30 | offset += this->start_point.serialize(outbuffer + offset);
31 | offset += this->end_point.serialize(outbuffer + offset);
32 | return offset;
33 | }
34 |
35 | virtual int deserialize(unsigned char *inbuffer)
36 | {
37 | int offset = 0;
38 | offset += this->start_point.deserialize(inbuffer + offset);
39 | offset += this->end_point.deserialize(inbuffer + offset);
40 | return offset;
41 | }
42 |
43 | const char * getType(){ return "jsk_recognition_msgs/Segment"; };
44 | const char * getMD5(){ return "0125c553546d7123dccaeab992a9e29e"; };
45 |
46 | };
47 |
48 | }
49 | #endif
50 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/moveit_msgs/OrientedBoundingBox.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_moveit_msgs_OrientedBoundingBox_h
2 | #define _ROS_moveit_msgs_OrientedBoundingBox_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "geometry_msgs/Pose.h"
9 | #include "geometry_msgs/Point32.h"
10 |
11 | namespace moveit_msgs
12 | {
13 |
14 | class OrientedBoundingBox : public ros::Msg
15 | {
16 | public:
17 | typedef geometry_msgs::Pose _pose_type;
18 | _pose_type pose;
19 | typedef geometry_msgs::Point32 _extents_type;
20 | _extents_type extents;
21 |
22 | OrientedBoundingBox():
23 | pose(),
24 | extents()
25 | {
26 | }
27 |
28 | virtual int serialize(unsigned char *outbuffer) const
29 | {
30 | int offset = 0;
31 | offset += this->pose.serialize(outbuffer + offset);
32 | offset += this->extents.serialize(outbuffer + offset);
33 | return offset;
34 | }
35 |
36 | virtual int deserialize(unsigned char *inbuffer)
37 | {
38 | int offset = 0;
39 | offset += this->pose.deserialize(inbuffer + offset);
40 | offset += this->extents.deserialize(inbuffer + offset);
41 | return offset;
42 | }
43 |
44 | const char * getType(){ return "moveit_msgs/OrientedBoundingBox"; };
45 | const char * getMD5(){ return "da3bd98e7cb14efa4141367a9d886ee7"; };
46 |
47 | };
48 |
49 | }
50 | #endif
51 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/moveit_msgs/MotionSequenceItem.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_moveit_msgs_MotionSequenceItem_h
2 | #define _ROS_moveit_msgs_MotionSequenceItem_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "moveit_msgs/MotionPlanRequest.h"
9 |
10 | namespace moveit_msgs
11 | {
12 |
13 | class MotionSequenceItem : public ros::Msg
14 | {
15 | public:
16 | typedef moveit_msgs::MotionPlanRequest _req_type;
17 | _req_type req;
18 | typedef float _blend_radius_type;
19 | _blend_radius_type blend_radius;
20 |
21 | MotionSequenceItem():
22 | req(),
23 | blend_radius(0)
24 | {
25 | }
26 |
27 | virtual int serialize(unsigned char *outbuffer) const
28 | {
29 | int offset = 0;
30 | offset += this->req.serialize(outbuffer + offset);
31 | offset += serializeAvrFloat64(outbuffer + offset, this->blend_radius);
32 | return offset;
33 | }
34 |
35 | virtual int deserialize(unsigned char *inbuffer)
36 | {
37 | int offset = 0;
38 | offset += this->req.deserialize(inbuffer + offset);
39 | offset += deserializeAvrFloat64(inbuffer + offset, &(this->blend_radius));
40 | return offset;
41 | }
42 |
43 | const char * getType(){ return "moveit_msgs/MotionSequenceItem"; };
44 | const char * getMD5(){ return "932aef4280f479e42c693b8b285624bf"; };
45 |
46 | };
47 |
48 | }
49 | #endif
50 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/geographic_msgs/GeoPointStamped.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_geographic_msgs_GeoPointStamped_h
2 | #define _ROS_geographic_msgs_GeoPointStamped_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "std_msgs/Header.h"
9 | #include "geographic_msgs/GeoPoint.h"
10 |
11 | namespace geographic_msgs
12 | {
13 |
14 | class GeoPointStamped : public ros::Msg
15 | {
16 | public:
17 | typedef std_msgs::Header _header_type;
18 | _header_type header;
19 | typedef geographic_msgs::GeoPoint _position_type;
20 | _position_type position;
21 |
22 | GeoPointStamped():
23 | header(),
24 | position()
25 | {
26 | }
27 |
28 | virtual int serialize(unsigned char *outbuffer) const
29 | {
30 | int offset = 0;
31 | offset += this->header.serialize(outbuffer + offset);
32 | offset += this->position.serialize(outbuffer + offset);
33 | return offset;
34 | }
35 |
36 | virtual int deserialize(unsigned char *inbuffer)
37 | {
38 | int offset = 0;
39 | offset += this->header.deserialize(inbuffer + offset);
40 | offset += this->position.deserialize(inbuffer + offset);
41 | return offset;
42 | }
43 |
44 | const char * getType(){ return "geographic_msgs/GeoPointStamped"; };
45 | const char * getMD5(){ return "ea50d268b03080563c330351a21edc89"; };
46 |
47 | };
48 |
49 | }
50 | #endif
51 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/geographic_msgs/GeoPose.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_geographic_msgs_GeoPose_h
2 | #define _ROS_geographic_msgs_GeoPose_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "geographic_msgs/GeoPoint.h"
9 | #include "geometry_msgs/Quaternion.h"
10 |
11 | namespace geographic_msgs
12 | {
13 |
14 | class GeoPose : public ros::Msg
15 | {
16 | public:
17 | typedef geographic_msgs::GeoPoint _position_type;
18 | _position_type position;
19 | typedef geometry_msgs::Quaternion _orientation_type;
20 | _orientation_type orientation;
21 |
22 | GeoPose():
23 | position(),
24 | orientation()
25 | {
26 | }
27 |
28 | virtual int serialize(unsigned char *outbuffer) const
29 | {
30 | int offset = 0;
31 | offset += this->position.serialize(outbuffer + offset);
32 | offset += this->orientation.serialize(outbuffer + offset);
33 | return offset;
34 | }
35 |
36 | virtual int deserialize(unsigned char *inbuffer)
37 | {
38 | int offset = 0;
39 | offset += this->position.deserialize(inbuffer + offset);
40 | offset += this->orientation.deserialize(inbuffer + offset);
41 | return offset;
42 | }
43 |
44 | const char * getType(){ return "geographic_msgs/GeoPose"; };
45 | const char * getMD5(){ return "778680b5172de58b7c057d973576c784"; };
46 |
47 | };
48 |
49 | }
50 | #endif
51 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/geometry_msgs/Transform.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_geometry_msgs_Transform_h
2 | #define _ROS_geometry_msgs_Transform_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "geometry_msgs/Vector3.h"
9 | #include "geometry_msgs/Quaternion.h"
10 |
11 | namespace geometry_msgs
12 | {
13 |
14 | class Transform : public ros::Msg
15 | {
16 | public:
17 | typedef geometry_msgs::Vector3 _translation_type;
18 | _translation_type translation;
19 | typedef geometry_msgs::Quaternion _rotation_type;
20 | _rotation_type rotation;
21 |
22 | Transform():
23 | translation(),
24 | rotation()
25 | {
26 | }
27 |
28 | virtual int serialize(unsigned char *outbuffer) const
29 | {
30 | int offset = 0;
31 | offset += this->translation.serialize(outbuffer + offset);
32 | offset += this->rotation.serialize(outbuffer + offset);
33 | return offset;
34 | }
35 |
36 | virtual int deserialize(unsigned char *inbuffer)
37 | {
38 | int offset = 0;
39 | offset += this->translation.deserialize(inbuffer + offset);
40 | offset += this->rotation.deserialize(inbuffer + offset);
41 | return offset;
42 | }
43 |
44 | const char * getType(){ return "geometry_msgs/Transform"; };
45 | const char * getMD5(){ return "ac9eff44abf714214112b05d54a3cf9b"; };
46 |
47 | };
48 |
49 | }
50 | #endif
51 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/geometry_msgs/QuaternionStamped.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_geometry_msgs_QuaternionStamped_h
2 | #define _ROS_geometry_msgs_QuaternionStamped_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "std_msgs/Header.h"
9 | #include "geometry_msgs/Quaternion.h"
10 |
11 | namespace geometry_msgs
12 | {
13 |
14 | class QuaternionStamped : public ros::Msg
15 | {
16 | public:
17 | typedef std_msgs::Header _header_type;
18 | _header_type header;
19 | typedef geometry_msgs::Quaternion _quaternion_type;
20 | _quaternion_type quaternion;
21 |
22 | QuaternionStamped():
23 | header(),
24 | quaternion()
25 | {
26 | }
27 |
28 | virtual int serialize(unsigned char *outbuffer) const
29 | {
30 | int offset = 0;
31 | offset += this->header.serialize(outbuffer + offset);
32 | offset += this->quaternion.serialize(outbuffer + offset);
33 | return offset;
34 | }
35 |
36 | virtual int deserialize(unsigned char *inbuffer)
37 | {
38 | int offset = 0;
39 | offset += this->header.deserialize(inbuffer + offset);
40 | offset += this->quaternion.deserialize(inbuffer + offset);
41 | return offset;
42 | }
43 |
44 | const char * getType(){ return "geometry_msgs/QuaternionStamped"; };
45 | const char * getMD5(){ return "e57f1e547e0e1fd13504588ffc8334e2"; };
46 |
47 | };
48 |
49 | }
50 | #endif
51 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/tf2_msgs/LookupTransformResult.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_tf2_msgs_LookupTransformResult_h
2 | #define _ROS_tf2_msgs_LookupTransformResult_h
3 |
4 | #include
5 | #include
6 | #include
7 | #include "ros/msg.h"
8 | #include "geometry_msgs/TransformStamped.h"
9 | #include "tf2_msgs/TF2Error.h"
10 |
11 | namespace tf2_msgs
12 | {
13 |
14 | class LookupTransformResult : public ros::Msg
15 | {
16 | public:
17 | typedef geometry_msgs::TransformStamped _transform_type;
18 | _transform_type transform;
19 | typedef tf2_msgs::TF2Error _error_type;
20 | _error_type error;
21 |
22 | LookupTransformResult():
23 | transform(),
24 | error()
25 | {
26 | }
27 |
28 | virtual int serialize(unsigned char *outbuffer) const
29 | {
30 | int offset = 0;
31 | offset += this->transform.serialize(outbuffer + offset);
32 | offset += this->error.serialize(outbuffer + offset);
33 | return offset;
34 | }
35 |
36 | virtual int deserialize(unsigned char *inbuffer)
37 | {
38 | int offset = 0;
39 | offset += this->transform.deserialize(inbuffer + offset);
40 | offset += this->error.deserialize(inbuffer + offset);
41 | return offset;
42 | }
43 |
44 | const char * getType(){ return "tf2_msgs/LookupTransformResult"; };
45 | const char * getMD5(){ return "3fe5db6a19ca9cfb675418c5ad875c36"; };
46 |
47 | };
48 |
49 | }
50 | #endif
51 |
--------------------------------------------------------------------------------
/ros_face_Arduino/lib/ros_lib/geometry_msgs/Point.h:
--------------------------------------------------------------------------------
1 | #ifndef _ROS_geometry_msgs_Point_h
2 | #define _ROS_geometry_msgs_Point_h
3 |
4 | #include
5 | #include