tftp.c
Go to the documentation of this file.
1 /***************************************************************************
2  * _ _ ____ _
3  * Project ___| | | | _ \| |
4  * / __| | | | |_) | |
5  * | (__| |_| | _ <| |___
6  * \___|\___/|_| \_\_____|
7  *
8  * Copyright (C) 1998 - 2017, Daniel Stenberg, <daniel@haxx.se>, et al.
9  *
10  * This software is licensed as described in the file COPYING, which
11  * you should have received as part of this distribution. The terms
12  * are also available at https://curl.haxx.se/docs/copyright.html.
13  *
14  * You may opt to use, copy, modify, merge, publish, distribute and/or sell
15  * copies of the Software, and permit persons to whom the Software is
16  * furnished to do so, under the terms of the COPYING file.
17  *
18  * This software is distributed on an "AS IS" basis, WITHOUT WARRANTY OF ANY
19  * KIND, either express or implied.
20  *
21  ***************************************************************************/
22 
23 #include "curl_setup.h"
24 
25 #ifndef CURL_DISABLE_TFTP
26 
27 #ifdef HAVE_NETINET_IN_H
28 #include <netinet/in.h>
29 #endif
30 #ifdef HAVE_NETDB_H
31 #include <netdb.h>
32 #endif
33 #ifdef HAVE_ARPA_INET_H
34 #include <arpa/inet.h>
35 #endif
36 #ifdef HAVE_NET_IF_H
37 #include <net/if.h>
38 #endif
39 #ifdef HAVE_SYS_IOCTL_H
40 #include <sys/ioctl.h>
41 #endif
42 
43 #ifdef HAVE_SYS_PARAM_H
44 #include <sys/param.h>
45 #endif
46 
47 #include "urldata.h"
48 #include <curl/curl.h>
49 #include "transfer.h"
50 #include "sendf.h"
51 #include "tftp.h"
52 #include "progress.h"
53 #include "connect.h"
54 #include "strerror.h"
55 #include "sockaddr.h" /* required for Curl_sockaddr_storage */
56 #include "multiif.h"
57 #include "url.h"
58 #include "strcase.h"
59 #include "speedcheck.h"
60 #include "select.h"
61 #include "escape.h"
62 
63 /* The last 3 #include files should be in this order */
64 #include "curl_printf.h"
65 #include "curl_memory.h"
66 #include "memdebug.h"
67 
68 /* RFC2348 allows the block size to be negotiated */
69 #define TFTP_BLKSIZE_DEFAULT 512
70 #define TFTP_BLKSIZE_MIN 8
71 #define TFTP_BLKSIZE_MAX 65464
72 #define TFTP_OPTION_BLKSIZE "blksize"
73 
74 /* from RFC2349: */
75 #define TFTP_OPTION_TSIZE "tsize"
76 #define TFTP_OPTION_INTERVAL "timeout"
77 
78 typedef enum {
81 } tftp_mode_t;
82 
83 typedef enum {
88 } tftp_state_t;
89 
90 typedef enum {
100 } tftp_event_t;
101 
102 typedef enum {
110  TFTP_ERR_NOSUCHUSER, /* This will never be triggered by this code */
111 
112  /* The remaining error codes are internal to curl */
116 } tftp_error_t;
117 
118 typedef struct tftp_packet {
119  unsigned char *data;
120 } tftp_packet_t;
121 
122 typedef struct tftp_state_data {
127  struct connectdata *conn;
129  int retries;
132  time_t start_time;
133  time_t max_time;
134  time_t rx_time;
135  unsigned short block;
136  struct Curl_sockaddr_storage local_addr;
137  struct Curl_sockaddr_storage remote_addr;
139  int rbytes;
140  int sbytes;
141  int blksize;
146 
147 
148 /* Forward declarations */
151 static CURLcode tftp_connect(struct connectdata *conn, bool *done);
152 static CURLcode tftp_disconnect(struct connectdata *conn,
153  bool dead_connection);
154 static CURLcode tftp_do(struct connectdata *conn, bool *done);
155 static CURLcode tftp_done(struct connectdata *conn,
156  CURLcode, bool premature);
157 static CURLcode tftp_setup_connection(struct connectdata * conn);
158 static CURLcode tftp_multi_statemach(struct connectdata *conn, bool *done);
159 static CURLcode tftp_doing(struct connectdata *conn, bool *dophase_done);
160 static int tftp_getsock(struct connectdata *conn, curl_socket_t *socks,
161  int numsocks);
163 
164 
165 /*
166  * TFTP protocol handler.
167  */
168 
170  "TFTP", /* scheme */
171  tftp_setup_connection, /* setup_connection */
172  tftp_do, /* do_it */
173  tftp_done, /* done */
174  ZERO_NULL, /* do_more */
175  tftp_connect, /* connect_it */
176  tftp_multi_statemach, /* connecting */
177  tftp_doing, /* doing */
178  tftp_getsock, /* proto_getsock */
179  tftp_getsock, /* doing_getsock */
180  ZERO_NULL, /* domore_getsock */
181  ZERO_NULL, /* perform_getsock */
182  tftp_disconnect, /* disconnect */
183  ZERO_NULL, /* readwrite */
184  ZERO_NULL, /* connection_check */
185  PORT_TFTP, /* defport */
186  CURLPROTO_TFTP, /* protocol */
187  PROTOPT_NONE | PROTOPT_NOURLQUERY /* flags */
188 };
189 
190 /**********************************************************
191  *
192  * tftp_set_timeouts -
193  *
194  * Set timeouts based on state machine state.
195  * Use user provided connect timeouts until DATA or ACK
196  * packet is received, then use user-provided transfer timeouts
197  *
198  *
199  **********************************************************/
201 {
202  time_t maxtime, timeout;
203  time_t timeout_ms;
204  bool start = (state->state == TFTP_STATE_START) ? TRUE : FALSE;
205 
206  time(&state->start_time);
207 
208  /* Compute drop-dead time */
209  timeout_ms = Curl_timeleft(state->conn->data, NULL, start);
210 
211  if(timeout_ms < 0) {
212  /* time-out, bail out, go home */
213  failf(state->conn->data, "Connection time-out");
215  }
216 
217  if(start) {
218 
219  maxtime = (time_t)(timeout_ms + 500) / 1000;
220  state->max_time = state->start_time + maxtime;
221 
222  /* Set per-block timeout to total */
223  timeout = maxtime;
224 
225  /* Average restart after 5 seconds */
226  state->retry_max = (int)timeout/5;
227 
228  if(state->retry_max < 1)
229  /* avoid division by zero below */
230  state->retry_max = 1;
231 
232  /* Compute the re-start interval to suit the timeout */
233  state->retry_time = (int)timeout/state->retry_max;
234  if(state->retry_time<1)
235  state->retry_time = 1;
236 
237  }
238  else {
239  if(timeout_ms > 0)
240  maxtime = (time_t)(timeout_ms + 500) / 1000;
241  else
242  maxtime = 3600;
243 
244  state->max_time = state->start_time + maxtime;
245 
246  /* Set per-block timeout to total */
247  timeout = maxtime;
248 
249  /* Average reposting an ACK after 5 seconds */
250  state->retry_max = (int)timeout/5;
251  }
252  /* But bound the total number */
253  if(state->retry_max<3)
254  state->retry_max = 3;
255 
256  if(state->retry_max>50)
257  state->retry_max = 50;
258 
259  /* Compute the re-ACK interval to suit the timeout */
260  state->retry_time = (int)(timeout/state->retry_max);
261  if(state->retry_time<1)
262  state->retry_time = 1;
263 
264  infof(state->conn->data,
265  "set timeouts for state %d; Total %ld, retry %d maxtry %d\n",
266  (int)state->state, (long)(state->max_time-state->start_time),
267  state->retry_time, state->retry_max);
268 
269  /* init RX time */
270  time(&state->rx_time);
271 
272  return CURLE_OK;
273 }
274 
275 /**********************************************************
276  *
277  * tftp_set_send_first
278  *
279  * Event handler for the START state
280  *
281  **********************************************************/
282 
283 static void setpacketevent(tftp_packet_t *packet, unsigned short num)
284 {
285  packet->data[0] = (unsigned char)(num >> 8);
286  packet->data[1] = (unsigned char)(num & 0xff);
287 }
288 
289 
290 static void setpacketblock(tftp_packet_t *packet, unsigned short num)
291 {
292  packet->data[2] = (unsigned char)(num >> 8);
293  packet->data[3] = (unsigned char)(num & 0xff);
294 }
295 
296 static unsigned short getrpacketevent(const tftp_packet_t *packet)
297 {
298  return (unsigned short)((packet->data[0] << 8) | packet->data[1]);
299 }
300 
301 static unsigned short getrpacketblock(const tftp_packet_t *packet)
302 {
303  return (unsigned short)((packet->data[2] << 8) | packet->data[3]);
304 }
305 
306 static size_t Curl_strnlen(const char *string, size_t maxlen)
307 {
308  const char *end = memchr(string, '\0', maxlen);
309  return end ? (size_t) (end - string) : maxlen;
310 }
311 
312 static const char *tftp_option_get(const char *buf, size_t len,
313  const char **option, const char **value)
314 {
315  size_t loc;
316 
317  loc = Curl_strnlen(buf, len);
318  loc++; /* NULL term */
319 
320  if(loc >= len)
321  return NULL;
322  *option = buf;
323 
324  loc += Curl_strnlen(buf + loc, len-loc);
325  loc++; /* NULL term */
326 
327  if(loc > len)
328  return NULL;
329  *value = &buf[strlen(*option) + 1];
330 
331  return &buf[loc];
332 }
333 
335  const char *ptr, int len)
336 {
337  const char *tmp = ptr;
338  struct Curl_easy *data = state->conn->data;
339 
340  /* if OACK doesn't contain blksize option, the default (512) must be used */
341  state->blksize = TFTP_BLKSIZE_DEFAULT;
342 
343  while(tmp < ptr + len) {
344  const char *option, *value;
345 
346  tmp = tftp_option_get(tmp, ptr + len - tmp, &option, &value);
347  if(tmp == NULL) {
348  failf(data, "Malformed ACK packet, rejecting");
349  return CURLE_TFTP_ILLEGAL;
350  }
351 
352  infof(data, "got option=(%s) value=(%s)\n", option, value);
353 
354  if(checkprefix(option, TFTP_OPTION_BLKSIZE)) {
355  long blksize;
356 
357  blksize = strtol(value, NULL, 10);
358 
359  if(!blksize) {
360  failf(data, "invalid blocksize value in OACK packet");
361  return CURLE_TFTP_ILLEGAL;
362  }
363  if(blksize > TFTP_BLKSIZE_MAX) {
364  failf(data, "%s (%d)", "blksize is larger than max supported",
366  return CURLE_TFTP_ILLEGAL;
367  }
368  else if(blksize < TFTP_BLKSIZE_MIN) {
369  failf(data, "%s (%d)", "blksize is smaller than min supported",
371  return CURLE_TFTP_ILLEGAL;
372  }
373  else if(blksize > state->requested_blksize) {
374  /* could realloc pkt buffers here, but the spec doesn't call out
375  * support for the server requesting a bigger blksize than the client
376  * requests */
377  failf(data, "%s (%ld)",
378  "server requested blksize larger than allocated", blksize);
379  return CURLE_TFTP_ILLEGAL;
380  }
381 
382  state->blksize = (int)blksize;
383  infof(data, "%s (%d) %s (%d)\n", "blksize parsed from OACK",
384  state->blksize, "requested", state->requested_blksize);
385  }
386  else if(checkprefix(option, TFTP_OPTION_TSIZE)) {
387  long tsize = 0;
388 
389  tsize = strtol(value, NULL, 10);
390  infof(data, "%s (%ld)\n", "tsize parsed from OACK", tsize);
391 
392  /* tsize should be ignored on upload: Who cares about the size of the
393  remote file? */
394  if(!data->set.upload) {
395  if(!tsize) {
396  failf(data, "invalid tsize -:%s:- value in OACK packet", value);
397  return CURLE_TFTP_ILLEGAL;
398  }
399  Curl_pgrsSetDownloadSize(data, tsize);
400  }
401  }
402  }
403 
404  return CURLE_OK;
405 }
406 
407 static size_t tftp_option_add(tftp_state_data_t *state, size_t csize,
408  char *buf, const char *option)
409 {
410  if(( strlen(option) + csize + 1) > (size_t)state->blksize)
411  return 0;
412  strcpy(buf, option);
413  return strlen(option) + 1;
414 }
415 
417  tftp_event_t event)
418 {
420 #ifndef CURL_DISABLE_VERBOSE_STRINGS
421  struct Curl_easy *data = state->conn->data;
422 
423  infof(data, "%s\n", "Connected for transmit");
424 #endif
425  state->state = TFTP_STATE_TX;
426  result = tftp_set_timeouts(state);
427  if(result)
428  return result;
429  return tftp_tx(state, event);
430 }
431 
433  tftp_event_t event)
434 {
436 #ifndef CURL_DISABLE_VERBOSE_STRINGS
437  struct Curl_easy *data = state->conn->data;
438 
439  infof(data, "%s\n", "Connected for receive");
440 #endif
441  state->state = TFTP_STATE_RX;
442  result = tftp_set_timeouts(state);
443  if(result)
444  return result;
445  return tftp_rx(state, event);
446 }
447 
449 {
450  size_t sbytes;
451  ssize_t senddata;
452  const char *mode = "octet";
453  char *filename;
454  char buf[64];
455  struct Curl_easy *data = state->conn->data;
457 
458  /* Set ascii mode if -B flag was used */
459  if(data->set.prefer_ascii)
460  mode = "netascii";
461 
462  switch(event) {
463 
464  case TFTP_EVENT_INIT: /* Send the first packet out */
465  case TFTP_EVENT_TIMEOUT: /* Resend the first packet out */
466  /* Increment the retry counter, quit if over the limit */
467  state->retries++;
468  if(state->retries>state->retry_max) {
469  state->error = TFTP_ERR_NORESPONSE;
470  state->state = TFTP_STATE_FIN;
471  return result;
472  }
473 
474  if(data->set.upload) {
475  /* If we are uploading, send an WRQ */
477  state->conn->data->req.upload_fromhere =
478  (char *)state->spacket.data + 4;
479  if(data->state.infilesize != -1)
481  }
482  else {
483  /* If we are downloading, send an RRQ */
485  }
486  /* As RFC3617 describes the separator slash is not actually part of the
487  file name so we skip the always-present first letter of the path
488  string. */
489  result = Curl_urldecode(data, &state->conn->data->state.path[1], 0,
490  &filename, NULL, FALSE);
491  if(result)
492  return result;
493 
494  if(strlen(filename) > (state->blksize - strlen(mode) - 4)) {
495  failf(data, "TFTP file name too long\n");
496  free(filename);
497  return CURLE_TFTP_ILLEGAL; /* too long file name field */
498  }
499 
500  snprintf((char *)state->spacket.data + 2,
501  state->blksize,
502  "%s%c%s%c", filename, '\0', mode, '\0');
503  sbytes = 4 + strlen(filename) + strlen(mode);
504 
505  /* optional addition of TFTP options */
506  if(!data->set.tftp_no_options) {
507  /* add tsize option */
508  if(data->set.upload && (data->state.infilesize != -1))
509  snprintf(buf, sizeof(buf), "%" CURL_FORMAT_CURL_OFF_T,
510  data->state.infilesize);
511  else
512  strcpy(buf, "0"); /* the destination is large enough */
513 
514  sbytes += tftp_option_add(state, sbytes,
515  (char *)state->spacket.data + sbytes,
517  sbytes += tftp_option_add(state, sbytes,
518  (char *)state->spacket.data + sbytes, buf);
519  /* add blksize option */
520  snprintf(buf, sizeof(buf), "%d", state->requested_blksize);
521  sbytes += tftp_option_add(state, sbytes,
522  (char *)state->spacket.data + sbytes,
524  sbytes += tftp_option_add(state, sbytes,
525  (char *)state->spacket.data + sbytes, buf);
526 
527  /* add timeout option */
528  snprintf(buf, sizeof(buf), "%d", state->retry_time);
529  sbytes += tftp_option_add(state, sbytes,
530  (char *)state->spacket.data + sbytes,
532  sbytes += tftp_option_add(state, sbytes,
533  (char *)state->spacket.data + sbytes, buf);
534  }
535 
536  /* the typecase for the 3rd argument is mostly for systems that do
537  not have a size_t argument, like older unixes that want an 'int' */
538  senddata = sendto(state->sockfd, (void *)state->spacket.data,
539  (SEND_TYPE_ARG3)sbytes, 0,
540  state->conn->ip_addr->ai_addr,
541  state->conn->ip_addr->ai_addrlen);
542  if(senddata != (ssize_t)sbytes) {
543  failf(data, "%s", Curl_strerror(state->conn, SOCKERRNO));
544  }
545  free(filename);
546  break;
547 
548  case TFTP_EVENT_OACK:
549  if(data->set.upload) {
550  result = tftp_connect_for_tx(state, event);
551  }
552  else {
553  result = tftp_connect_for_rx(state, event);
554  }
555  break;
556 
557  case TFTP_EVENT_ACK: /* Connected for transmit */
558  result = tftp_connect_for_tx(state, event);
559  break;
560 
561  case TFTP_EVENT_DATA: /* Connected for receive */
562  result = tftp_connect_for_rx(state, event);
563  break;
564 
565  case TFTP_EVENT_ERROR:
566  state->state = TFTP_STATE_FIN;
567  break;
568 
569  default:
570  failf(state->conn->data, "tftp_send_first: internal error");
571  break;
572  }
573 
574  return result;
575 }
576 
577 /* the next blocknum is x + 1 but it needs to wrap at an unsigned 16bit
578  boundary */
579 #define NEXT_BLOCKNUM(x) (((x) + 1)&0xffff)
580 
581 /**********************************************************
582  *
583  * tftp_rx
584  *
585  * Event handler for the RX state
586  *
587  **********************************************************/
589 {
590  ssize_t sbytes;
591  int rblock;
592  struct Curl_easy *data = state->conn->data;
593 
594  switch(event) {
595 
596  case TFTP_EVENT_DATA:
597  /* Is this the block we expect? */
598  rblock = getrpacketblock(&state->rpacket);
599  if(NEXT_BLOCKNUM(state->block) == rblock) {
600  /* This is the expected block. Reset counters and ACK it. */
601  state->retries = 0;
602  }
603  else if(state->block == rblock) {
604  /* This is the last recently received block again. Log it and ACK it
605  again. */
606  infof(data, "Received last DATA packet block %d again.\n", rblock);
607  }
608  else {
609  /* totally unexpected, just log it */
610  infof(data,
611  "Received unexpected DATA packet block %d, expecting block %d\n",
612  rblock, NEXT_BLOCKNUM(state->block));
613  break;
614  }
615 
616  /* ACK this block. */
617  state->block = (unsigned short)rblock;
619  setpacketblock(&state->spacket, state->block);
620  sbytes = sendto(state->sockfd, (void *)state->spacket.data,
621  4, SEND_4TH_ARG,
622  (struct sockaddr *)&state->remote_addr,
623  state->remote_addrlen);
624  if(sbytes < 0) {
625  failf(data, "%s", Curl_strerror(state->conn, SOCKERRNO));
626  return CURLE_SEND_ERROR;
627  }
628 
629  /* Check if completed (That is, a less than full packet is received) */
630  if(state->rbytes < (ssize_t)state->blksize + 4) {
631  state->state = TFTP_STATE_FIN;
632  }
633  else {
634  state->state = TFTP_STATE_RX;
635  }
636  time(&state->rx_time);
637  break;
638 
639  case TFTP_EVENT_OACK:
640  /* ACK option acknowledgement so we can move on to data */
641  state->block = 0;
642  state->retries = 0;
644  setpacketblock(&state->spacket, state->block);
645  sbytes = sendto(state->sockfd, (void *)state->spacket.data,
646  4, SEND_4TH_ARG,
647  (struct sockaddr *)&state->remote_addr,
648  state->remote_addrlen);
649  if(sbytes < 0) {
650  failf(data, "%s", Curl_strerror(state->conn, SOCKERRNO));
651  return CURLE_SEND_ERROR;
652  }
653 
654  /* we're ready to RX data */
655  state->state = TFTP_STATE_RX;
656  time(&state->rx_time);
657  break;
658 
659  case TFTP_EVENT_TIMEOUT:
660  /* Increment the retry count and fail if over the limit */
661  state->retries++;
662  infof(data,
663  "Timeout waiting for block %d ACK. Retries = %d\n",
664  NEXT_BLOCKNUM(state->block), state->retries);
665  if(state->retries > state->retry_max) {
666  state->error = TFTP_ERR_TIMEOUT;
667  state->state = TFTP_STATE_FIN;
668  }
669  else {
670  /* Resend the previous ACK */
671  sbytes = sendto(state->sockfd, (void *)state->spacket.data,
672  4, SEND_4TH_ARG,
673  (struct sockaddr *)&state->remote_addr,
674  state->remote_addrlen);
675  if(sbytes<0) {
676  failf(data, "%s", Curl_strerror(state->conn, SOCKERRNO));
677  return CURLE_SEND_ERROR;
678  }
679  }
680  break;
681 
682  case TFTP_EVENT_ERROR:
684  setpacketblock(&state->spacket, state->block);
685  (void)sendto(state->sockfd, (void *)state->spacket.data,
686  4, SEND_4TH_ARG,
687  (struct sockaddr *)&state->remote_addr,
688  state->remote_addrlen);
689  /* don't bother with the return code, but if the socket is still up we
690  * should be a good TFTP client and let the server know we're done */
691  state->state = TFTP_STATE_FIN;
692  break;
693 
694  default:
695  failf(data, "%s", "tftp_rx: internal error");
696  return CURLE_TFTP_ILLEGAL; /* not really the perfect return code for
697  this */
698  }
699  return CURLE_OK;
700 }
701 
702 /**********************************************************
703  *
704  * tftp_tx
705  *
706  * Event handler for the TX state
707  *
708  **********************************************************/
710 {
711  struct Curl_easy *data = state->conn->data;
712  ssize_t sbytes;
713  int rblock;
715  struct SingleRequest *k = &data->req;
716  int cb; /* Bytes currently read */
717 
718  switch(event) {
719 
720  case TFTP_EVENT_ACK:
721  case TFTP_EVENT_OACK:
722  if(event == TFTP_EVENT_ACK) {
723  /* Ack the packet */
724  rblock = getrpacketblock(&state->rpacket);
725 
726  if(rblock != state->block &&
727  /* There's a bug in tftpd-hpa that causes it to send us an ack for
728  * 65535 when the block number wraps to 0. So when we're expecting
729  * 0, also accept 65535. See
730  * http://syslinux.zytor.com/archives/2010-September/015253.html
731  * */
732  !(state->block == 0 && rblock == 65535)) {
733  /* This isn't the expected block. Log it and up the retry counter */
734  infof(data, "Received ACK for block %d, expecting %d\n",
735  rblock, state->block);
736  state->retries++;
737  /* Bail out if over the maximum */
738  if(state->retries>state->retry_max) {
739  failf(data, "tftp_tx: giving up waiting for block %d ack",
740  state->block);
741  result = CURLE_SEND_ERROR;
742  }
743  else {
744  /* Re-send the data packet */
745  sbytes = sendto(state->sockfd, (void *)state->spacket.data,
746  4 + state->sbytes, SEND_4TH_ARG,
747  (struct sockaddr *)&state->remote_addr,
748  state->remote_addrlen);
749  /* Check all sbytes were sent */
750  if(sbytes<0) {
751  failf(data, "%s", Curl_strerror(state->conn, SOCKERRNO));
752  result = CURLE_SEND_ERROR;
753  }
754  }
755 
756  return result;
757  }
758  /* This is the expected packet. Reset the counters and send the next
759  block */
760  time(&state->rx_time);
761  state->block++;
762  }
763  else
764  state->block = 1; /* first data block is 1 when using OACK */
765 
766  state->retries = 0;
768  setpacketblock(&state->spacket, state->block);
769  if(state->block > 1 && state->sbytes < (int)state->blksize) {
770  state->state = TFTP_STATE_FIN;
771  return CURLE_OK;
772  }
773 
774  /* TFTP considers data block size < 512 bytes as an end of session. So
775  * in some cases we must wait for additional data to build full (512 bytes)
776  * data block.
777  * */
778  state->sbytes = 0;
779  state->conn->data->req.upload_fromhere = (char *)state->spacket.data + 4;
780  do {
781  result = Curl_fillreadbuffer(state->conn, state->blksize - state->sbytes,
782  &cb);
783  if(result)
784  return result;
785  state->sbytes += cb;
786  state->conn->data->req.upload_fromhere += cb;
787  } while(state->sbytes < state->blksize && cb != 0);
788 
789  sbytes = sendto(state->sockfd, (void *) state->spacket.data,
790  4 + state->sbytes, SEND_4TH_ARG,
791  (struct sockaddr *)&state->remote_addr,
792  state->remote_addrlen);
793  /* Check all sbytes were sent */
794  if(sbytes<0) {
795  failf(data, "%s", Curl_strerror(state->conn, SOCKERRNO));
796  return CURLE_SEND_ERROR;
797  }
798  /* Update the progress meter */
799  k->writebytecount += state->sbytes;
801  break;
802 
803  case TFTP_EVENT_TIMEOUT:
804  /* Increment the retry counter and log the timeout */
805  state->retries++;
806  infof(data, "Timeout waiting for block %d ACK. "
807  " Retries = %d\n", NEXT_BLOCKNUM(state->block), state->retries);
808  /* Decide if we've had enough */
809  if(state->retries > state->retry_max) {
810  state->error = TFTP_ERR_TIMEOUT;
811  state->state = TFTP_STATE_FIN;
812  }
813  else {
814  /* Re-send the data packet */
815  sbytes = sendto(state->sockfd, (void *)state->spacket.data,
816  4 + state->sbytes, SEND_4TH_ARG,
817  (struct sockaddr *)&state->remote_addr,
818  state->remote_addrlen);
819  /* Check all sbytes were sent */
820  if(sbytes<0) {
821  failf(data, "%s", Curl_strerror(state->conn, SOCKERRNO));
822  return CURLE_SEND_ERROR;
823  }
824  /* since this was a re-send, we remain at the still byte position */
826  }
827  break;
828 
829  case TFTP_EVENT_ERROR:
830  state->state = TFTP_STATE_FIN;
832  setpacketblock(&state->spacket, state->block);
833  (void)sendto(state->sockfd, (void *)state->spacket.data, 4, SEND_4TH_ARG,
834  (struct sockaddr *)&state->remote_addr,
835  state->remote_addrlen);
836  /* don't bother with the return code, but if the socket is still up we
837  * should be a good TFTP client and let the server know we're done */
838  state->state = TFTP_STATE_FIN;
839  break;
840 
841  default:
842  failf(data, "tftp_tx: internal error, event: %i", (int)(event));
843  break;
844  }
845 
846  return result;
847 }
848 
849 /**********************************************************
850  *
851  * tftp_translate_code
852  *
853  * Translate internal error codes to CURL error codes
854  *
855  **********************************************************/
857 {
859 
860  if(error != TFTP_ERR_NONE) {
861  switch(error) {
862  case TFTP_ERR_NOTFOUND:
863  result = CURLE_TFTP_NOTFOUND;
864  break;
865  case TFTP_ERR_PERM:
866  result = CURLE_TFTP_PERM;
867  break;
868  case TFTP_ERR_DISKFULL:
869  result = CURLE_REMOTE_DISK_FULL;
870  break;
871  case TFTP_ERR_UNDEF:
872  case TFTP_ERR_ILLEGAL:
873  result = CURLE_TFTP_ILLEGAL;
874  break;
875  case TFTP_ERR_UNKNOWNID:
876  result = CURLE_TFTP_UNKNOWNID;
877  break;
878  case TFTP_ERR_EXISTS:
879  result = CURLE_REMOTE_FILE_EXISTS;
880  break;
881  case TFTP_ERR_NOSUCHUSER:
882  result = CURLE_TFTP_NOSUCHUSER;
883  break;
884  case TFTP_ERR_TIMEOUT:
885  result = CURLE_OPERATION_TIMEDOUT;
886  break;
887  case TFTP_ERR_NORESPONSE:
888  result = CURLE_COULDNT_CONNECT;
889  break;
890  default:
891  result = CURLE_ABORTED_BY_CALLBACK;
892  break;
893  }
894  }
895  else
896  result = CURLE_OK;
897 
898  return result;
899 }
900 
901 /**********************************************************
902  *
903  * tftp_state_machine
904  *
905  * The tftp state machine event dispatcher
906  *
907  **********************************************************/
909  tftp_event_t event)
910 {
912  struct Curl_easy *data = state->conn->data;
913 
914  switch(state->state) {
915  case TFTP_STATE_START:
916  DEBUGF(infof(data, "TFTP_STATE_START\n"));
917  result = tftp_send_first(state, event);
918  break;
919  case TFTP_STATE_RX:
920  DEBUGF(infof(data, "TFTP_STATE_RX\n"));
921  result = tftp_rx(state, event);
922  break;
923  case TFTP_STATE_TX:
924  DEBUGF(infof(data, "TFTP_STATE_TX\n"));
925  result = tftp_tx(state, event);
926  break;
927  case TFTP_STATE_FIN:
928  infof(data, "%s\n", "TFTP finished");
929  break;
930  default:
931  DEBUGF(infof(data, "STATE: %d\n", state->state));
932  failf(data, "%s", "Internal state machine error");
933  result = CURLE_TFTP_ILLEGAL;
934  break;
935  }
936 
937  return result;
938 }
939 
940 /**********************************************************
941  *
942  * tftp_disconnect
943  *
944  * The disconnect callback
945  *
946  **********************************************************/
947 static CURLcode tftp_disconnect(struct connectdata *conn, bool dead_connection)
948 {
950  (void) dead_connection;
951 
952  /* done, free dynamically allocated pkt buffers */
953  if(state) {
954  Curl_safefree(state->rpacket.data);
955  Curl_safefree(state->spacket.data);
956  free(state);
957  }
958 
959  return CURLE_OK;
960 }
961 
962 /**********************************************************
963  *
964  * tftp_connect
965  *
966  * The connect callback
967  *
968  **********************************************************/
969 static CURLcode tftp_connect(struct connectdata *conn, bool *done)
970 {
972  int blksize, rc;
973 
974  blksize = TFTP_BLKSIZE_DEFAULT;
975 
976  state = conn->proto.tftpc = calloc(1, sizeof(tftp_state_data_t));
977  if(!state)
978  return CURLE_OUT_OF_MEMORY;
979 
980  /* alloc pkt buffers based on specified blksize */
981  if(conn->data->set.tftp_blksize) {
982  blksize = (int)conn->data->set.tftp_blksize;
983  if(blksize > TFTP_BLKSIZE_MAX || blksize < TFTP_BLKSIZE_MIN)
984  return CURLE_TFTP_ILLEGAL;
985  }
986 
987  if(!state->rpacket.data) {
988  state->rpacket.data = calloc(1, blksize + 2 + 2);
989 
990  if(!state->rpacket.data)
991  return CURLE_OUT_OF_MEMORY;
992  }
993 
994  if(!state->spacket.data) {
995  state->spacket.data = calloc(1, blksize + 2 + 2);
996 
997  if(!state->spacket.data)
998  return CURLE_OUT_OF_MEMORY;
999  }
1000 
1001  /* we don't keep TFTP connections up basically because there's none or very
1002  * little gain for UDP */
1003  connclose(conn, "TFTP");
1004 
1005  state->conn = conn;
1006  state->sockfd = state->conn->sock[FIRSTSOCKET];
1007  state->state = TFTP_STATE_START;
1008  state->error = TFTP_ERR_NONE;
1009  state->blksize = TFTP_BLKSIZE_DEFAULT;
1010  state->requested_blksize = blksize;
1011 
1012  ((struct sockaddr *)&state->local_addr)->sa_family =
1013  (unsigned short)(conn->ip_addr->ai_family);
1014 
1015  tftp_set_timeouts(state);
1016 
1017  if(!conn->bits.bound) {
1018  /* If not already bound, bind to any interface, random UDP port. If it is
1019  * reused or a custom local port was desired, this has already been done!
1020  *
1021  * We once used the size of the local_addr struct as the third argument
1022  * for bind() to better work with IPv6 or whatever size the struct could
1023  * have, but we learned that at least Tru64, AIX and IRIX *requires* the
1024  * size of that argument to match the exact size of a 'sockaddr_in' struct
1025  * when running IPv4-only.
1026  *
1027  * Therefore we use the size from the address we connected to, which we
1028  * assume uses the same IP version and thus hopefully this works for both
1029  * IPv4 and IPv6...
1030  */
1031  rc = bind(state->sockfd, (struct sockaddr *)&state->local_addr,
1032  conn->ip_addr->ai_addrlen);
1033  if(rc) {
1034  failf(conn->data, "bind() failed; %s",
1035  Curl_strerror(conn, SOCKERRNO));
1036  return CURLE_COULDNT_CONNECT;
1037  }
1038  conn->bits.bound = TRUE;
1039  }
1040 
1041  Curl_pgrsStartNow(conn->data);
1042 
1043  *done = TRUE;
1044 
1045  return CURLE_OK;
1046 }
1047 
1048 /**********************************************************
1049  *
1050  * tftp_done
1051  *
1052  * The done callback
1053  *
1054  **********************************************************/
1055 static CURLcode tftp_done(struct connectdata *conn, CURLcode status,
1056  bool premature)
1057 {
1060 
1061  (void)status; /* unused */
1062  (void)premature; /* not used */
1063 
1064  if(Curl_pgrsDone(conn))
1066 
1067  /* If we have encountered an error */
1068  if(state)
1069  result = tftp_translate_code(state->error);
1070 
1071  return result;
1072 }
1073 
1074 /**********************************************************
1075  *
1076  * tftp_getsock
1077  *
1078  * The getsock callback
1079  *
1080  **********************************************************/
1081 static int tftp_getsock(struct connectdata *conn, curl_socket_t *socks,
1082  int numsocks)
1083 {
1084  if(!numsocks)
1085  return GETSOCK_BLANK;
1086 
1087  socks[0] = conn->sock[FIRSTSOCKET];
1088 
1089  return GETSOCK_READSOCK(0);
1090 }
1091 
1092 /**********************************************************
1093  *
1094  * tftp_receive_packet
1095  *
1096  * Called once select fires and data is ready on the socket
1097  *
1098  **********************************************************/
1100 {
1101  struct Curl_sockaddr_storage fromaddr;
1104  struct Curl_easy *data = conn->data;
1106  struct SingleRequest *k = &data->req;
1107 
1108  /* Receive the packet */
1109  fromlen = sizeof(fromaddr);
1110  state->rbytes = (int)recvfrom(state->sockfd,
1111  (void *)state->rpacket.data,
1112  state->blksize + 4,
1113  0,
1114  (struct sockaddr *)&fromaddr,
1115  &fromlen);
1116  if(state->remote_addrlen == 0) {
1117  memcpy(&state->remote_addr, &fromaddr, fromlen);
1118  state->remote_addrlen = fromlen;
1119  }
1120 
1121  /* Sanity check packet length */
1122  if(state->rbytes < 4) {
1123  failf(data, "Received too short packet");
1124  /* Not a timeout, but how best to handle it? */
1125  state->event = TFTP_EVENT_TIMEOUT;
1126  }
1127  else {
1128  /* The event is given by the TFTP packet time */
1129  unsigned short event = getrpacketevent(&state->rpacket);
1130  state->event = (tftp_event_t)event;
1131 
1132  switch(state->event) {
1133  case TFTP_EVENT_DATA:
1134  /* Don't pass to the client empty or retransmitted packets */
1135  if(state->rbytes > 4 &&
1136  (NEXT_BLOCKNUM(state->block) == getrpacketblock(&state->rpacket))) {
1137  result = Curl_client_write(conn, CLIENTWRITE_BODY,
1138  (char *)state->rpacket.data + 4,
1139  state->rbytes-4);
1140  if(result) {
1142  return result;
1143  }
1144  k->bytecount += state->rbytes-4;
1145  Curl_pgrsSetDownloadCounter(data, (curl_off_t) k->bytecount);
1146  }
1147  break;
1148  case TFTP_EVENT_ERROR:
1149  {
1150  unsigned short error = getrpacketblock(&state->rpacket);
1151  state->error = (tftp_error_t)error;
1152  infof(data, "%s\n", (const char *)state->rpacket.data + 4);
1153  break;
1154  }
1155  case TFTP_EVENT_ACK:
1156  break;
1157  case TFTP_EVENT_OACK:
1158  result = tftp_parse_option_ack(state,
1159  (const char *)state->rpacket.data + 2,
1160  state->rbytes-2);
1161  if(result)
1162  return result;
1163  break;
1164  case TFTP_EVENT_RRQ:
1165  case TFTP_EVENT_WRQ:
1166  default:
1167  failf(data, "%s", "Internal error: Unexpected packet");
1168  break;
1169  }
1170 
1171  /* Update the progress meter */
1172  if(Curl_pgrsUpdate(conn)) {
1175  }
1176  }
1177  return result;
1178 }
1179 
1180 /**********************************************************
1181  *
1182  * tftp_state_timeout
1183  *
1184  * Check if timeouts have been reached
1185  *
1186  **********************************************************/
1187 static long tftp_state_timeout(struct connectdata *conn, tftp_event_t *event)
1188 {
1189  time_t current;
1191 
1192  if(event)
1193  *event = TFTP_EVENT_NONE;
1194 
1195  time(&current);
1196  if(current > state->max_time) {
1197  DEBUGF(infof(conn->data, "timeout: %ld > %ld\n",
1198  (long)current, (long)state->max_time));
1199  state->error = TFTP_ERR_TIMEOUT;
1200  state->state = TFTP_STATE_FIN;
1201  return 0;
1202  }
1203  if(current > state->rx_time + state->retry_time) {
1204  if(event)
1205  *event = TFTP_EVENT_TIMEOUT;
1206  time(&state->rx_time); /* update even though we received nothing */
1207  }
1208 
1209  /* there's a typecast below here since 'time_t' may in fact be larger than
1210  'long', but we estimate that a 'long' will still be able to hold number
1211  of seconds even if "only" 32 bit */
1212  return (long)(state->max_time - current);
1213 }
1214 
1215 /**********************************************************
1216  *
1217  * tftp_multi_statemach
1218  *
1219  * Handle single RX socket event and return
1220  *
1221  **********************************************************/
1222 static CURLcode tftp_multi_statemach(struct connectdata *conn, bool *done)
1223 {
1224  int rc;
1225  tftp_event_t event;
1227  struct Curl_easy *data = conn->data;
1229  long timeout_ms = tftp_state_timeout(conn, &event);
1230 
1231  *done = FALSE;
1232 
1233  if(timeout_ms <= 0) {
1234  failf(data, "TFTP response timeout");
1235  return CURLE_OPERATION_TIMEDOUT;
1236  }
1237  if(event != TFTP_EVENT_NONE) {
1238  result = tftp_state_machine(state, event);
1239  if(result)
1240  return result;
1241  *done = (state->state == TFTP_STATE_FIN) ? TRUE : FALSE;
1242  if(*done)
1243  /* Tell curl we're done */
1244  Curl_setup_transfer(conn, -1, -1, FALSE, NULL, -1, NULL);
1245  }
1246  else {
1247  /* no timeouts to handle, check our socket */
1248  rc = SOCKET_READABLE(state->sockfd, 0);
1249 
1250  if(rc == -1) {
1251  /* bail out */
1252  int error = SOCKERRNO;
1253  failf(data, "%s", Curl_strerror(conn, error));
1254  state->event = TFTP_EVENT_ERROR;
1255  }
1256  else if(rc != 0) {
1257  result = tftp_receive_packet(conn);
1258  if(result)
1259  return result;
1260  result = tftp_state_machine(state, state->event);
1261  if(result)
1262  return result;
1263  *done = (state->state == TFTP_STATE_FIN) ? TRUE : FALSE;
1264  if(*done)
1265  /* Tell curl we're done */
1266  Curl_setup_transfer(conn, -1, -1, FALSE, NULL, -1, NULL);
1267  }
1268  /* if rc == 0, then select() timed out */
1269  }
1270 
1271  return result;
1272 }
1273 
1274 /**********************************************************
1275  *
1276  * tftp_doing
1277  *
1278  * Called from multi.c while DOing
1279  *
1280  **********************************************************/
1281 static CURLcode tftp_doing(struct connectdata *conn, bool *dophase_done)
1282 {
1283  CURLcode result;
1284  result = tftp_multi_statemach(conn, dophase_done);
1285 
1286  if(*dophase_done) {
1287  DEBUGF(infof(conn->data, "DO phase is complete\n"));
1288  }
1289  else if(!result) {
1290  /* The multi code doesn't have this logic for the DOING state so we
1291  provide it for TFTP since it may do the entire transfer in this
1292  state. */
1293  if(Curl_pgrsUpdate(conn))
1294  result = CURLE_ABORTED_BY_CALLBACK;
1295  else
1296  result = Curl_speedcheck(conn->data, Curl_tvnow());
1297  }
1298  return result;
1299 }
1300 
1301 /**********************************************************
1302  *
1303  * tftp_peform
1304  *
1305  * Entry point for transfer from tftp_do, sarts state mach
1306  *
1307  **********************************************************/
1308 static CURLcode tftp_perform(struct connectdata *conn, bool *dophase_done)
1309 {
1312 
1313  *dophase_done = FALSE;
1314 
1315  result = tftp_state_machine(state, TFTP_EVENT_INIT);
1316 
1317  if((state->state == TFTP_STATE_FIN) || result)
1318  return result;
1319 
1320  tftp_multi_statemach(conn, dophase_done);
1321 
1322  if(*dophase_done)
1323  DEBUGF(infof(conn->data, "DO phase is complete\n"));
1324 
1325  return result;
1326 }
1327 
1328 
1329 /**********************************************************
1330  *
1331  * tftp_do
1332  *
1333  * The do callback
1334  *
1335  * This callback initiates the TFTP transfer
1336  *
1337  **********************************************************/
1338 
1339 static CURLcode tftp_do(struct connectdata *conn, bool *done)
1340 {
1342  CURLcode result;
1343 
1344  *done = FALSE;
1345 
1346  if(!conn->proto.tftpc) {
1347  result = tftp_connect(conn, done);
1348  if(result)
1349  return result;
1350  }
1351 
1352  state = (tftp_state_data_t *)conn->proto.tftpc;
1353  if(!state)
1354  return CURLE_TFTP_ILLEGAL;
1355 
1356  result = tftp_perform(conn, done);
1357 
1358  /* If tftp_perform() returned an error, use that for return code. If it
1359  was OK, see if tftp_translate_code() has an error. */
1360  if(!result)
1361  /* If we have encountered an internal tftp error, translate it. */
1362  result = tftp_translate_code(state->error);
1363 
1364  return result;
1365 }
1366 
1368 {
1369  struct Curl_easy *data = conn->data;
1370  char *type;
1371  char command;
1372 
1373  conn->socktype = SOCK_DGRAM; /* UDP datagram based */
1374 
1375  /* TFTP URLs support an extension like ";mode=<typecode>" that
1376  * we'll try to get now! */
1377  type = strstr(data->state.path, ";mode=");
1378 
1379  if(!type)
1380  type = strstr(conn->host.rawalloc, ";mode=");
1381 
1382  if(type) {
1383  *type = 0; /* it was in the middle of the hostname */
1384  command = Curl_raw_toupper(type[6]);
1385 
1386  switch(command) {
1387  case 'A': /* ASCII mode */
1388  case 'N': /* NETASCII mode */
1389  data->set.prefer_ascii = TRUE;
1390  break;
1391 
1392  case 'O': /* octet mode */
1393  case 'I': /* binary mode */
1394  default:
1395  /* switch off ASCII */
1396  data->set.prefer_ascii = FALSE;
1397  break;
1398  }
1399  }
1400 
1401  return CURLE_OK;
1402 }
1403 #endif
#define free(ptr)
Definition: curl_memory.h:130
static CURLcode tftp_doing(struct connectdata *conn, bool *dophase_done)
Definition: tftp.c:1281
#define TFTP_BLKSIZE_DEFAULT
Definition: tftp.c:69
time_t max_time
Definition: tftp.c:133
#define state(x, y)
Definition: ftp.c:100
#define CLIENTWRITE_BODY
Definition: sendf.h:50
char * upload_fromhere
Definition: urldata.h:603
static unsigned short getrpacketblock(const tftp_packet_t *packet)
Definition: tftp.c:301
struct ConnectBits bits
Definition: urldata.h:893
CURLcode Curl_urldecode(struct Curl_easy *data, const char *string, size_t length, char **ostring, size_t *olen, bool reject_ctrl)
Definition: escape.c:146
bool bound
Definition: urldata.h:428
filename
#define bind
Definition: setup-os400.h:211
struct UserDefined set
Definition: urldata.h:1762
static CURLcode tftp_connect_for_tx(tftp_state_data_t *state, tftp_event_t event)
Definition: tftp.c:416
void Curl_pgrsSetUploadCounter(struct Curl_easy *data, curl_off_t size)
Definition: progress.c:304
#define connclose(x, y)
Definition: connect.h:141
tftp_state_t
Definition: tftp.c:83
struct connectdata * conn
Definition: tftp.c:127
int retry_max
Definition: tftp.c:131
time_t start_time
Definition: tftp.c:132
tftp_event_t event
Definition: tftp.c:126
#define FIRSTSOCKET
Definition: urldata.h:487
#define PROTOPT_NOURLQUERY
Definition: urldata.h:711
#define PORT_TFTP
Definition: urldata.h:37
#define TFTP_BLKSIZE_MAX
Definition: tftp.c:71
#define NEXT_BLOCKNUM(x)
Definition: tftp.c:579
bool prefer_ascii
Definition: urldata.h:1618
static int tftp_getsock(struct connectdata *conn, curl_socket_t *socks, int numsocks)
Definition: tftp.c:1081
static CURLcode tftp_connect_for_rx(tftp_state_data_t *state, tftp_event_t event)
Definition: tftp.c:432
#define failf
Definition: sendf.h:48
tftp_state_t state
Definition: tftp.c:123
tftp_packet_t rpacket
Definition: tftp.c:143
#define SOCKERRNO
int sbytes
Definition: tftp.c:140
static CURLcode tftp_connect(struct connectdata *conn, bool *done)
Definition: tftp.c:969
int Curl_pgrsDone(struct connectdata *conn)
Definition: progress.c:133
uv_timer_t timeout
Definition: multi-uv.c:42
UNITTEST_START char * ptr
Definition: unit1330.c:38
CURLcode
Definition: curl.h:454
#define GETSOCK_READSOCK(x)
Definition: multiif.h:48
#define TFTP_OPTION_TSIZE
Definition: tftp.c:75
struct hostname host
Definition: urldata.h:833
#define recvfrom
Definition: setup-os400.h:213
const struct Curl_handler Curl_handler_tftp
Definition: tftp.c:169
bool tftp_no_options
Definition: urldata.h:1552
void Curl_pgrsStartNow(struct Curl_easy *data)
Definition: progress.c:226
UNITTEST_START int result
Definition: unit1304.c:49
static CURLcode tftp_done(struct connectdata *conn, CURLcode, bool premature)
Definition: tftp.c:1055
struct Curl_sockaddr_storage local_addr
Definition: tftp.c:136
#define TFTP_BLKSIZE_MIN
Definition: tftp.c:70
tftp_error_t error
Definition: tftp.c:125
#define sendto
Definition: setup-os400.h:212
struct sockaddr * ai_addr
Definition: curl_addrinfo.h:58
size_t len
Definition: curl_sasl.c:55
int blksize
Definition: tftp.c:141
tftp_packet_t spacket
Definition: tftp.c:144
int Curl_pgrsUpdate(struct connectdata *conn)
Definition: progress.c:350
tftp_mode_t
Definition: tftp.c:78
memcpy(filename, filename1, strlen(filename1))
Curl_addrinfo * ip_addr
Definition: urldata.h:821
static CURLcode tftp_setup_connection(struct connectdata *conn)
Definition: tftp.c:1367
CURL_TYPEOF_CURL_SOCKLEN_T curl_socklen_t
Definition: system.h:414
#define ZERO_NULL
Definition: curlx.c:131
static CURLcode tftp_set_timeouts(tftp_state_data_t *state)
Definition: tftp.c:200
void Curl_setup_transfer(struct connectdata *conn, int sockindex, curl_off_t size, bool getheader, curl_off_t *bytecountp, int writesockindex, curl_off_t *writecountp)
Definition: transfer.c:1989
#define FALSE
time_t Curl_timeleft(struct Curl_easy *data, struct curltime *nowp, bool duringconnect)
Definition: connect.c:182
curl_easy_setopt expects a curl_off_t argument for this option curl_easy_setopt expects a curl_write_callback argument for this option curl_easy_setopt expects a curl_ioctl_callback argument for this option curl_easy_setopt expects a curl_opensocket_callback argument for this option curl_easy_setopt expects a curl_debug_callback argument for this option curl_easy_setopt expects a curl_conv_callback argument for this option curl_easy_setopt expects a private data pointer as argument for this option curl_easy_setopt expects a FILE *argument for this option curl_easy_setopt expects a struct curl_httppost *argument for this option curl_easy_setopt expects a struct curl_slist *argument for this option curl_easy_getinfo expects a pointer to char *for this info curl_easy_getinfo expects a pointer to double for this info curl_easy_getinfo expects a pointer to struct curl_tlssessioninfo *for this info curl_easy_getinfo expects a pointer to curl_socket_t for this info size_t
struct SingleRequest req
Definition: urldata.h:1761
ROSLIB_DECL std::string command(const std::string &cmd)
UNITTEST_START int rc
Definition: unit1301.c:31
int requested_blksize
Definition: tftp.c:142
const char * Curl_strerror(struct connectdata *conn, int err)
Definition: strerror.c:646
curl_off_t infilesize
Definition: urldata.h:1345
#define TFTP_OPTION_BLKSIZE
Definition: tftp.c:72
#define SOCKET_READABLE(x, z)
Definition: select.h:79
static const char * tftp_option_get(const char *buf, size_t len, const char **option, const char **value)
Definition: tftp.c:312
#define SEND_TYPE_ARG3
Definition: config-dos.h:103
unsigned short block
Definition: tftp.c:135
static size_t tftp_option_add(tftp_state_data_t *state, size_t csize, char *buf, const char *option)
Definition: tftp.c:407
curl_socklen_t remote_addrlen
Definition: tftp.c:138
static void setpacketevent(tftp_packet_t *packet, unsigned short num)
Definition: tftp.c:283
#define SEND_4TH_ARG
void Curl_pgrsSetUploadSize(struct Curl_easy *data, curl_off_t size)
Definition: progress.c:334
void Curl_pgrsSetDownloadSize(struct Curl_easy *data, curl_off_t size)
Definition: progress.c:322
#define GETSOCK_BLANK
Definition: multiif.h:42
#define Curl_tvnow()
Definition: timeval.h:57
CURL_TYPEOF_CURL_OFF_T curl_off_t
Definition: system.h:420
int socktype
Definition: urldata.h:831
CURLcode Curl_fillreadbuffer(struct connectdata *conn, int bytes, int *nreadp)
Definition: transfer.c:112
static CURLcode tftp_perform(struct connectdata *conn, bool *dophase_done)
Definition: tftp.c:1308
#define CURLPROTO_TFTP
Definition: curl.h:855
char * path
Definition: urldata.h:1329
tftp_mode_t mode
Definition: tftp.c:124
Definition: curl.h:455
CURLcode Curl_speedcheck(struct Curl_easy *data, struct curltime now)
Definition: speedcheck.c:39
static CURLcode tftp_multi_statemach(struct connectdata *conn, bool *done)
Definition: tftp.c:1222
long tftp_blksize
Definition: urldata.h:1551
static CURLcode tftp_parse_option_ack(tftp_state_data_t *state, const char *ptr, int len)
Definition: tftp.c:334
CURLcode Curl_client_write(struct connectdata *conn, int type, char *ptr, size_t len)
Definition: sendf.c:624
#define PROTOPT_NONE
Definition: urldata.h:699
#define Curl_safefree(ptr)
Definition: memdebug.h:170
struct UrlState state
Definition: urldata.h:1769
static CURLcode tftp_tx(tftp_state_data_t *state, tftp_event_t event)
Definition: tftp.c:709
tftp_event_t
Definition: tftp.c:90
static curl_socklen_t fromlen
Definition: tftpd.c:198
curl_off_t writebytecount
Definition: urldata.h:527
static CURLcode tftp_state_machine(tftp_state_data_t *state, tftp_event_t event)
Definition: tftp.c:908
struct tftp_packet tftp_packet_t
#define ssize_t
Definition: config-win32.h:382
static long tftp_state_timeout(struct connectdata *conn, tftp_event_t *event)
Definition: tftp.c:1187
curl_socket_t sock[2]
Definition: urldata.h:876
void Curl_pgrsSetDownloadCounter(struct Curl_easy *data, curl_off_t size)
Definition: progress.c:286
tftp_error_t
Definition: tftp.c:102
struct Curl_sockaddr_storage remote_addr
Definition: tftp.c:137
static CURLcode tftp_translate_code(tftp_error_t error)
Definition: tftp.c:856
static size_t Curl_strnlen(const char *string, size_t maxlen)
Definition: tftp.c:306
static size_t cb(char *d, size_t n, size_t l, void *p)
Definition: 10-at-a-time.c:91
char buf[3]
Definition: unit1398.c:32
static CURLcode tftp_do(struct connectdata *conn, bool *done)
Definition: tftp.c:1339
static CURLcode tftp_disconnect(struct connectdata *conn, bool dead_connection)
Definition: tftp.c:947
static void setpacketblock(tftp_packet_t *packet, unsigned short num)
Definition: tftp.c:290
struct tftp_state_data tftp_state_data_t
#define infof
Definition: sendf.h:44
UNITTEST_START int * value
Definition: unit1602.c:51
static CURLcode tftp_send_first(tftp_state_data_t *state, tftp_event_t event)
Definition: tftp.c:448
char * rawalloc
Definition: urldata.h:442
curl_socklen_t ai_addrlen
Definition: curl_addrinfo.h:56
#define TFTP_OPTION_INTERVAL
Definition: tftp.c:76
#define checkprefix(a, b)
Definition: strcase.h:46
static CURLcode tftp_receive_packet(struct connectdata *conn)
Definition: tftp.c:1099
union connectdata::@34 proto
int retries
Definition: tftp.c:129
int retry_time
Definition: tftp.c:130
#define snprintf
Definition: curl_printf.h:42
static CURLcode tftp_rx(tftp_state_data_t *state, tftp_event_t event)
Definition: tftp.c:588
#define TRUE
struct tftp_state_data * tftpc
Definition: urldata.h:1001
static int current
Definition: tftpd.c:188
int curl_socket_t
Definition: curl.h:130
static unsigned short getrpacketevent(const tftp_packet_t *packet)
Definition: tftp.c:296
int rbytes
Definition: tftp.c:139
bool upload
Definition: urldata.h:1632
char Curl_raw_toupper(char in)
Definition: strcase.c:31
Definition: debug.c:29
curl_socket_t sockfd
Definition: tftp.c:128
#define calloc(nbelem, size)
Definition: curl_memory.h:126
time_t rx_time
Definition: tftp.c:134
unsigned char * data
Definition: tftp.c:119
#define CURL_FORMAT_CURL_OFF_T
Definition: system.h:373
#define DEBUGF(x)
struct Curl_easy * data
Definition: urldata.h:791


rc_tagdetect_client
Author(s): Monika Florek-Jasinska , Raphael Schaller
autogenerated on Sat Feb 13 2021 03:42:16