| 123456789101112131415161718192021222324252627282930313233343536373839404142434445464748495051525354555657585960616263646566676869707172737475767778798081828384858687888990919293949596979899100101102103104105106107108109110111112113114115116117118119120121122123124125126127128129130131132133134135136137138139140141142143144145146147148149150151152153154155156157158159160161162163164165166167168169170171172173174175176177178179180181182183184185186187188189190 |
- ;; Auto-generated. Do not edit!
- (when (boundp 'waterplus_map_tools::GetChargerByName)
- (if (not (find-package "WATERPLUS_MAP_TOOLS"))
- (make-package "WATERPLUS_MAP_TOOLS"))
- (shadow 'GetChargerByName (find-package "WATERPLUS_MAP_TOOLS")))
- (unless (find-package "WATERPLUS_MAP_TOOLS::GETCHARGERBYNAME")
- (make-package "WATERPLUS_MAP_TOOLS::GETCHARGERBYNAME"))
- (unless (find-package "WATERPLUS_MAP_TOOLS::GETCHARGERBYNAMEREQUEST")
- (make-package "WATERPLUS_MAP_TOOLS::GETCHARGERBYNAMEREQUEST"))
- (unless (find-package "WATERPLUS_MAP_TOOLS::GETCHARGERBYNAMERESPONSE")
- (make-package "WATERPLUS_MAP_TOOLS::GETCHARGERBYNAMERESPONSE"))
- (in-package "ROS")
- (if (not (find-package "GEOMETRY_MSGS"))
- (ros::roseus-add-msgs "geometry_msgs"))
- (defclass waterplus_map_tools::GetChargerByNameRequest
- :super ros::object
- :slots (_name ))
- (defmethod waterplus_map_tools::GetChargerByNameRequest
- (:init
- (&key
- ((:name __name) "")
- )
- (send-super :init)
- (setq _name (string __name))
- self)
- (:name
- (&optional __name)
- (if __name (setq _name __name)) _name)
- (:serialization-length
- ()
- (+
- ;; string _name
- 4 (length _name)
- ))
- (:serialize
- (&optional strm)
- (let ((s (if strm strm
- (make-string-output-stream (send self :serialization-length)))))
- ;; string _name
- (write-long (length _name) s) (princ _name s)
- ;;
- (if (null strm) (get-output-stream-string s))))
- (:deserialize
- (buf &optional (ptr- 0))
- ;; string _name
- (let (n) (setq n (sys::peek buf ptr- :integer)) (incf ptr- 4) (setq _name (subseq buf ptr- (+ ptr- n))) (incf ptr- n))
- ;;
- self)
- )
- (defclass waterplus_map_tools::GetChargerByNameResponse
- :super ros::object
- :slots (_name _pose ))
- (defmethod waterplus_map_tools::GetChargerByNameResponse
- (:init
- (&key
- ((:name __name) "")
- ((:pose __pose) (instance geometry_msgs::Pose :init))
- )
- (send-super :init)
- (setq _name (string __name))
- (setq _pose __pose)
- self)
- (:name
- (&optional __name)
- (if __name (setq _name __name)) _name)
- (:pose
- (&rest __pose)
- (if (keywordp (car __pose))
- (send* _pose __pose)
- (progn
- (if __pose (setq _pose (car __pose)))
- _pose)))
- (:serialization-length
- ()
- (+
- ;; string _name
- 4 (length _name)
- ;; geometry_msgs/Pose _pose
- (send _pose :serialization-length)
- ))
- (:serialize
- (&optional strm)
- (let ((s (if strm strm
- (make-string-output-stream (send self :serialization-length)))))
- ;; string _name
- (write-long (length _name) s) (princ _name s)
- ;; geometry_msgs/Pose _pose
- (send _pose :serialize s)
- ;;
- (if (null strm) (get-output-stream-string s))))
- (:deserialize
- (buf &optional (ptr- 0))
- ;; string _name
- (let (n) (setq n (sys::peek buf ptr- :integer)) (incf ptr- 4) (setq _name (subseq buf ptr- (+ ptr- n))) (incf ptr- n))
- ;; geometry_msgs/Pose _pose
- (send _pose :deserialize buf ptr-) (incf ptr- (send _pose :serialization-length))
- ;;
- self)
- )
- (defclass waterplus_map_tools::GetChargerByName
- :super ros::object
- :slots ())
- (setf (get waterplus_map_tools::GetChargerByName :md5sum-) "5164dc1f215ac8183cbe49b46c7ff40e")
- (setf (get waterplus_map_tools::GetChargerByName :datatype-) "waterplus_map_tools/GetChargerByName")
- (setf (get waterplus_map_tools::GetChargerByName :request) waterplus_map_tools::GetChargerByNameRequest)
- (setf (get waterplus_map_tools::GetChargerByName :response) waterplus_map_tools::GetChargerByNameResponse)
- (defmethod waterplus_map_tools::GetChargerByNameRequest
- (:response () (instance waterplus_map_tools::GetChargerByNameResponse :init)))
- (setf (get waterplus_map_tools::GetChargerByNameRequest :md5sum-) "5164dc1f215ac8183cbe49b46c7ff40e")
- (setf (get waterplus_map_tools::GetChargerByNameRequest :datatype-) "waterplus_map_tools/GetChargerByNameRequest")
- (setf (get waterplus_map_tools::GetChargerByNameRequest :definition-)
- "string name
- ---
- 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
- ")
- (setf (get waterplus_map_tools::GetChargerByNameResponse :md5sum-) "5164dc1f215ac8183cbe49b46c7ff40e")
- (setf (get waterplus_map_tools::GetChargerByNameResponse :datatype-) "waterplus_map_tools/GetChargerByNameResponse")
- (setf (get waterplus_map_tools::GetChargerByNameResponse :definition-)
- "string name
- ---
- 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
- ")
- (provide :waterplus_map_tools/GetChargerByName "5164dc1f215ac8183cbe49b46c7ff40e")
|