| 123456789101112131415161718192021222324252627282930313233343536373839404142434445464748495051525354555657585960616263646566676869707172737475767778798081828384858687888990919293949596979899100101102103104105106107108109110111112113114115116117118119120121122123124125126127128129130131132133134135136137138139140141142143144145146147148149150151152153154155156157158159160161162163164165166167168169170171172173174175176177178179180181182183184185186187188189190191192193194195196197198199200201202203204205206207208209210211212213 |
- // Auto-generated. Do not edit!
- // (in-package waterplus_map_tools.srv)
- "use strict";
- const _serializer = _ros_msg_utils.Serialize;
- const _arraySerializer = _serializer.Array;
- const _deserializer = _ros_msg_utils.Deserialize;
- const _arrayDeserializer = _deserializer.Array;
- const _finder = _ros_msg_utils.Find;
- const _getByteLength = _ros_msg_utils.getByteLength;
- //-----------------------------------------------------------
- let geometry_msgs = _finder('geometry_msgs');
- //-----------------------------------------------------------
- class GetWaypointByNameRequest {
- constructor(initObj={}) {
- if (initObj === null) {
- // initObj === null is a special case for deserialization where we don't initialize fields
- this.name = null;
- }
- else {
- if (initObj.hasOwnProperty('name')) {
- this.name = initObj.name
- }
- else {
- this.name = '';
- }
- }
- }
- static serialize(obj, buffer, bufferOffset) {
- // Serializes a message object of type GetWaypointByNameRequest
- // Serialize message field [name]
- bufferOffset = _serializer.string(obj.name, buffer, bufferOffset);
- return bufferOffset;
- }
- static deserialize(buffer, bufferOffset=[0]) {
- //deserializes a message object of type GetWaypointByNameRequest
- let len;
- let data = new GetWaypointByNameRequest(null);
- // Deserialize message field [name]
- data.name = _deserializer.string(buffer, bufferOffset);
- return data;
- }
- static getMessageSize(object) {
- let length = 0;
- length += _getByteLength(object.name);
- return length + 4;
- }
- static datatype() {
- // Returns string type for a service object
- return 'waterplus_map_tools/GetWaypointByNameRequest';
- }
- static md5sum() {
- //Returns md5sum for a message object
- return 'c1f3d28f1b044c871e6eff2e9fc3c667';
- }
- static messageDefinition() {
- // Returns full string definition for message
- return `
- string name
-
- `;
- }
- static Resolve(msg) {
- // deep-construct a valid message object instance of whatever was passed in
- if (typeof msg !== 'object' || msg === null) {
- msg = {};
- }
- const resolved = new GetWaypointByNameRequest(null);
- if (msg.name !== undefined) {
- resolved.name = msg.name;
- }
- else {
- resolved.name = ''
- }
- return resolved;
- }
- };
- class GetWaypointByNameResponse {
- constructor(initObj={}) {
- if (initObj === null) {
- // initObj === null is a special case for deserialization where we don't initialize fields
- this.name = null;
- this.pose = null;
- }
- else {
- if (initObj.hasOwnProperty('name')) {
- this.name = initObj.name
- }
- else {
- this.name = '';
- }
- if (initObj.hasOwnProperty('pose')) {
- this.pose = initObj.pose
- }
- else {
- this.pose = new geometry_msgs.msg.Pose();
- }
- }
- }
- static serialize(obj, buffer, bufferOffset) {
- // Serializes a message object of type GetWaypointByNameResponse
- // Serialize message field [name]
- bufferOffset = _serializer.string(obj.name, buffer, bufferOffset);
- // Serialize message field [pose]
- bufferOffset = geometry_msgs.msg.Pose.serialize(obj.pose, buffer, bufferOffset);
- return bufferOffset;
- }
- static deserialize(buffer, bufferOffset=[0]) {
- //deserializes a message object of type GetWaypointByNameResponse
- let len;
- let data = new GetWaypointByNameResponse(null);
- // Deserialize message field [name]
- data.name = _deserializer.string(buffer, bufferOffset);
- // Deserialize message field [pose]
- data.pose = geometry_msgs.msg.Pose.deserialize(buffer, bufferOffset);
- return data;
- }
- static getMessageSize(object) {
- let length = 0;
- length += _getByteLength(object.name);
- return length + 60;
- }
- static datatype() {
- // Returns string type for a service object
- return 'waterplus_map_tools/GetWaypointByNameResponse';
- }
- static md5sum() {
- //Returns md5sum for a message object
- return '177d54286ddeee12eba514054bddffd5';
- }
- static messageDefinition() {
- // Returns full string definition for message
- return `
- string name
- geometry_msgs/Pose pose
-
- ================================================================================
- MSG: geometry_msgs/Pose
- # A representation of pose in free space, composed of position and orientation.
- Point position
- Quaternion orientation
-
- ================================================================================
- MSG: geometry_msgs/Point
- # This contains the position of a point in free space
- float64 x
- float64 y
- float64 z
-
- ================================================================================
- MSG: geometry_msgs/Quaternion
- # This represents an orientation in free space in quaternion form.
-
- float64 x
- float64 y
- float64 z
- float64 w
-
- `;
- }
- static Resolve(msg) {
- // deep-construct a valid message object instance of whatever was passed in
- if (typeof msg !== 'object' || msg === null) {
- msg = {};
- }
- const resolved = new GetWaypointByNameResponse(null);
- if (msg.name !== undefined) {
- resolved.name = msg.name;
- }
- else {
- resolved.name = ''
- }
- if (msg.pose !== undefined) {
- resolved.pose = geometry_msgs.msg.Pose.Resolve(msg.pose)
- }
- else {
- resolved.pose = new geometry_msgs.msg.Pose()
- }
- return resolved;
- }
- };
- module.exports = {
- Request: GetWaypointByNameRequest,
- Response: GetWaypointByNameResponse,
- md5sum() { return '5164dc1f215ac8183cbe49b46c7ff40e'; },
- datatype() { return 'waterplus_map_tools/GetWaypointByName'; }
- };
|