uv.h
Go to the documentation of this file.
1 /* Copyright Joyent, Inc. and other Node contributors. All rights reserved.
2  *
3  * Permission is hereby granted, free of charge, to any person obtaining a copy
4  * of this software and associated documentation files (the "Software"), to
5  * deal in the Software without restriction, including without limitation the
6  * rights to use, copy, modify, merge, publish, distribute, sublicense, and/or
7  * sell copies of the Software, and to permit persons to whom the Software is
8  * furnished to do so, subject to the following conditions:
9  *
10  * The above copyright notice and this permission notice shall be included in
11  * all copies or substantial portions of the Software.
12  *
13  * THE SOFTWARE IS PROVIDED "AS IS", WITHOUT WARRANTY OF ANY KIND, EXPRESS OR
14  * IMPLIED, INCLUDING BUT NOT LIMITED TO THE WARRANTIES OF MERCHANTABILITY,
15  * FITNESS FOR A PARTICULAR PURPOSE AND NONINFRINGEMENT. IN NO EVENT SHALL THE
16  * AUTHORS OR COPYRIGHT HOLDERS BE LIABLE FOR ANY CLAIM, DAMAGES OR OTHER
17  * LIABILITY, WHETHER IN AN ACTION OF CONTRACT, TORT OR OTHERWISE, ARISING
18  * FROM, OUT OF OR IN CONNECTION WITH THE SOFTWARE OR THE USE OR OTHER DEALINGS
19  * IN THE SOFTWARE.
20  */
21 
22 /* See https://github.com/libuv/libuv#documentation for documentation. */
23 
24 #ifndef UV_H
25 #define UV_H
26 #ifdef __cplusplus
27 extern "C" {
28 #endif
29 
30 #if defined(BUILDING_UV_SHARED) && defined(USING_UV_SHARED)
31 #error "Define either BUILDING_UV_SHARED or USING_UV_SHARED, not both."
32 #endif
33 
34 #ifdef _WIN32
35  /* Windows - set up dll import/export decorators. */
36 # if defined(BUILDING_UV_SHARED)
37  /* Building shared library. */
38 # define UV_EXTERN __declspec(dllexport)
39 # elif defined(USING_UV_SHARED)
40  /* Using shared library. */
41 # define UV_EXTERN __declspec(dllimport)
42 # else
43  /* Building static library. */
44 # define UV_EXTERN /* nothing */
45 # endif
46 #elif __GNUC__ >= 4
47 # define UV_EXTERN __attribute__((visibility("default")))
48 #else
49 # define UV_EXTERN /* nothing */
50 #endif
51 
52 #include "uv/errno.h"
53 #include "uv/version.h"
54 #include <stddef.h>
55 #include <stdio.h>
56 
57 #if defined(_MSC_VER) && _MSC_VER < 1600
58 # include "uv/stdint-msvc2008.h"
59 #else
60 # include <stdint.h>
61 #endif
62 
63 #if defined(_WIN32)
64 # include "uv/win.h"
65 #else
66 # include "uv/unix.h"
67 #endif
68 
69 /* Expand this list if necessary. */
70 #define UV_ERRNO_MAP(XX) \
71  XX(E2BIG, "argument list too long") \
72  XX(EACCES, "permission denied") \
73  XX(EADDRINUSE, "address already in use") \
74  XX(EADDRNOTAVAIL, "address not available") \
75  XX(EAFNOSUPPORT, "address family not supported") \
76  XX(EAGAIN, "resource temporarily unavailable") \
77  XX(EAI_ADDRFAMILY, "address family not supported") \
78  XX(EAI_AGAIN, "temporary failure") \
79  XX(EAI_BADFLAGS, "bad ai_flags value") \
80  XX(EAI_BADHINTS, "invalid value for hints") \
81  XX(EAI_CANCELED, "request canceled") \
82  XX(EAI_FAIL, "permanent failure") \
83  XX(EAI_FAMILY, "ai_family not supported") \
84  XX(EAI_MEMORY, "out of memory") \
85  XX(EAI_NODATA, "no address") \
86  XX(EAI_NONAME, "unknown node or service") \
87  XX(EAI_OVERFLOW, "argument buffer overflow") \
88  XX(EAI_PROTOCOL, "resolved protocol is unknown") \
89  XX(EAI_SERVICE, "service not available for socket type") \
90  XX(EAI_SOCKTYPE, "socket type not supported") \
91  XX(EALREADY, "connection already in progress") \
92  XX(EBADF, "bad file descriptor") \
93  XX(EBUSY, "resource busy or locked") \
94  XX(ECANCELED, "operation canceled") \
95  XX(ECHARSET, "invalid Unicode character") \
96  XX(ECONNABORTED, "software caused connection abort") \
97  XX(ECONNREFUSED, "connection refused") \
98  XX(ECONNRESET, "connection reset by peer") \
99  XX(EDESTADDRREQ, "destination address required") \
100  XX(EEXIST, "file already exists") \
101  XX(EFAULT, "bad address in system call argument") \
102  XX(EFBIG, "file too large") \
103  XX(EHOSTUNREACH, "host is unreachable") \
104  XX(EINTR, "interrupted system call") \
105  XX(EINVAL, "invalid argument") \
106  XX(EIO, "i/o error") \
107  XX(EISCONN, "socket is already connected") \
108  XX(EISDIR, "illegal operation on a directory") \
109  XX(ELOOP, "too many symbolic links encountered") \
110  XX(EMFILE, "too many open files") \
111  XX(EMSGSIZE, "message too long") \
112  XX(ENAMETOOLONG, "name too long") \
113  XX(ENETDOWN, "network is down") \
114  XX(ENETUNREACH, "network is unreachable") \
115  XX(ENFILE, "file table overflow") \
116  XX(ENOBUFS, "no buffer space available") \
117  XX(ENODEV, "no such device") \
118  XX(ENOENT, "no such file or directory") \
119  XX(ENOMEM, "not enough memory") \
120  XX(ENONET, "machine is not on the network") \
121  XX(ENOPROTOOPT, "protocol not available") \
122  XX(ENOSPC, "no space left on device") \
123  XX(ENOSYS, "function not implemented") \
124  XX(ENOTCONN, "socket is not connected") \
125  XX(ENOTDIR, "not a directory") \
126  XX(ENOTEMPTY, "directory not empty") \
127  XX(ENOTSOCK, "socket operation on non-socket") \
128  XX(ENOTSUP, "operation not supported on socket") \
129  XX(EPERM, "operation not permitted") \
130  XX(EPIPE, "broken pipe") \
131  XX(EPROTO, "protocol error") \
132  XX(EPROTONOSUPPORT, "protocol not supported") \
133  XX(EPROTOTYPE, "protocol wrong type for socket") \
134  XX(ERANGE, "result too large") \
135  XX(EROFS, "read-only file system") \
136  XX(ESHUTDOWN, "cannot send after transport endpoint shutdown") \
137  XX(ESPIPE, "invalid seek") \
138  XX(ESRCH, "no such process") \
139  XX(ETIMEDOUT, "connection timed out") \
140  XX(ETXTBSY, "text file is busy") \
141  XX(EXDEV, "cross-device link not permitted") \
142  XX(UNKNOWN, "unknown error") \
143  XX(EOF, "end of file") \
144  XX(ENXIO, "no such device or address") \
145  XX(EMLINK, "too many links") \
146  XX(EHOSTDOWN, "host is down") \
147  XX(EREMOTEIO, "remote I/O error") \
148  XX(ENOTTY, "inappropriate ioctl for device") \
149  XX(EFTYPE, "inappropriate file type or format") \
150  XX(EILSEQ, "illegal byte sequence") \
151 
152 #define UV_HANDLE_TYPE_MAP(XX) \
153  XX(ASYNC, async) \
154  XX(CHECK, check) \
155  XX(FS_EVENT, fs_event) \
156  XX(FS_POLL, fs_poll) \
157  XX(HANDLE, handle) \
158  XX(IDLE, idle) \
159  XX(NAMED_PIPE, pipe) \
160  XX(POLL, poll) \
161  XX(PREPARE, prepare) \
162  XX(PROCESS, process) \
163  XX(STREAM, stream) \
164  XX(TCP, tcp) \
165  XX(TIMER, timer) \
166  XX(TTY, tty) \
167  XX(UDP, udp) \
168  XX(SIGNAL, signal) \
169 
170 #define UV_REQ_TYPE_MAP(XX) \
171  XX(REQ, req) \
172  XX(CONNECT, connect) \
173  XX(WRITE, write) \
174  XX(SHUTDOWN, shutdown) \
175  XX(UDP_SEND, udp_send) \
176  XX(FS, fs) \
177  XX(WORK, work) \
178  XX(GETADDRINFO, getaddrinfo) \
179  XX(GETNAMEINFO, getnameinfo) \
180  XX(RANDOM, random) \
181 
182 typedef enum {
183 #define XX(code, _) UV_ ## code = UV__ ## code,
185 #undef XX
187 } uv_errno_t;
188 
189 typedef enum {
191 #define XX(uc, lc) UV_##uc,
193 #undef XX
197 
198 typedef enum {
200 #define XX(uc, lc) UV_##uc,
202 #undef XX
205 } uv_req_type;
206 
207 
208 /* Handle types. */
209 typedef struct uv_loop_s uv_loop_t;
210 typedef struct uv_handle_s uv_handle_t;
211 typedef struct uv_dir_s uv_dir_t;
212 typedef struct uv_stream_s uv_stream_t;
213 typedef struct uv_tcp_s uv_tcp_t;
214 typedef struct uv_udp_s uv_udp_t;
215 typedef struct uv_pipe_s uv_pipe_t;
216 typedef struct uv_tty_s uv_tty_t;
217 typedef struct uv_poll_s uv_poll_t;
218 typedef struct uv_timer_s uv_timer_t;
219 typedef struct uv_prepare_s uv_prepare_t;
220 typedef struct uv_check_s uv_check_t;
221 typedef struct uv_idle_s uv_idle_t;
222 typedef struct uv_async_s uv_async_t;
223 typedef struct uv_process_s uv_process_t;
225 typedef struct uv_fs_poll_s uv_fs_poll_t;
226 typedef struct uv_signal_s uv_signal_t;
227 
228 /* Request types. */
229 typedef struct uv_req_s uv_req_t;
233 typedef struct uv_write_s uv_write_t;
234 typedef struct uv_connect_s uv_connect_t;
236 typedef struct uv_fs_s uv_fs_t;
237 typedef struct uv_work_s uv_work_t;
238 typedef struct uv_random_s uv_random_t;
239 
240 /* None of the above. */
244 typedef struct uv_dirent_s uv_dirent_t;
245 typedef struct uv_passwd_s uv_passwd_t;
246 typedef struct uv_utsname_s uv_utsname_t;
247 typedef struct uv_statfs_s uv_statfs_t;
248 
249 typedef enum {
252 
253 typedef enum {
257 } uv_run_mode;
258 
259 
260 UV_EXTERN unsigned int uv_version(void);
261 UV_EXTERN const char* uv_version_string(void);
262 
263 typedef void* (*uv_malloc_func)(size_t size);
264 typedef void* (*uv_realloc_func)(void* ptr, size_t size);
265 typedef void* (*uv_calloc_func)(size_t count, size_t size);
266 typedef void (*uv_free_func)(void* ptr);
267 
269  uv_realloc_func realloc_func,
270  uv_calloc_func calloc_func,
271  uv_free_func free_func);
272 
276 /*
277  * NOTE:
278  * This function is DEPRECATED (to be removed after 0.12), users should
279  * allocate the loop manually and use uv_loop_init instead.
280  */
282 /*
283  * NOTE:
284  * This function is DEPRECATED (to be removed after 0.12). Users should use
285  * uv_loop_close and free the memory manually instead.
286  */
288 UV_EXTERN size_t uv_loop_size(void);
292 
295 
298 UV_EXTERN int uv_has_ref(const uv_handle_t*);
299 
302 
303 UV_EXTERN int uv_backend_fd(const uv_loop_t*);
305 
306 typedef void (*uv_alloc_cb)(uv_handle_t* handle,
307  size_t suggested_size,
308  uv_buf_t* buf);
309 typedef void (*uv_read_cb)(uv_stream_t* stream,
310  ssize_t nread,
311  const uv_buf_t* buf);
312 typedef void (*uv_write_cb)(uv_write_t* req, int status);
313 typedef void (*uv_connect_cb)(uv_connect_t* req, int status);
314 typedef void (*uv_shutdown_cb)(uv_shutdown_t* req, int status);
315 typedef void (*uv_connection_cb)(uv_stream_t* server, int status);
316 typedef void (*uv_close_cb)(uv_handle_t* handle);
317 typedef void (*uv_poll_cb)(uv_poll_t* handle, int status, int events);
318 typedef void (*uv_timer_cb)(uv_timer_t* handle);
319 typedef void (*uv_async_cb)(uv_async_t* handle);
321 typedef void (*uv_check_cb)(uv_check_t* handle);
322 typedef void (*uv_idle_cb)(uv_idle_t* handle);
323 typedef void (*uv_exit_cb)(uv_process_t*, int64_t exit_status, int term_signal);
324 typedef void (*uv_walk_cb)(uv_handle_t* handle, void* arg);
325 typedef void (*uv_fs_cb)(uv_fs_t* req);
326 typedef void (*uv_work_cb)(uv_work_t* req);
327 typedef void (*uv_after_work_cb)(uv_work_t* req, int status);
329  int status,
330  struct addrinfo* res);
332  int status,
333  const char* hostname,
334  const char* service);
335 typedef void (*uv_random_cb)(uv_random_t* req,
336  int status,
337  void* buf,
338  size_t buflen);
339 
340 typedef struct {
341  long tv_sec;
342  long tv_nsec;
343 } uv_timespec_t;
344 
345 
346 typedef struct {
363 } uv_stat_t;
364 
365 
367  const char* filename,
368  int events,
369  int status);
370 
372  int status,
373  const uv_stat_t* prev,
374  const uv_stat_t* curr);
375 
376 typedef void (*uv_signal_cb)(uv_signal_t* handle, int signum);
377 
378 
379 typedef enum {
382 } uv_membership;
383 
384 
385 UV_EXTERN int uv_translate_sys_error(int sys_errno);
386 
387 UV_EXTERN const char* uv_strerror(int err);
388 UV_EXTERN char* uv_strerror_r(int err, char* buf, size_t buflen);
389 
390 UV_EXTERN const char* uv_err_name(int err);
391 UV_EXTERN char* uv_err_name_r(int err, char* buf, size_t buflen);
392 
393 
394 #define UV_REQ_FIELDS \
395  /* public */ \
396  void* data; \
397  /* read-only */ \
398  uv_req_type type; \
399  /* private */ \
400  void* reserved[6]; \
401  UV_REQ_PRIVATE_FIELDS \
402 
403 /* Abstract base class of all requests. */
404 struct uv_req_s {
406 };
407 
408 
409 /* Platform-specific request types. */
411 
412 
416 
422 };
423 
424 
425 #define UV_HANDLE_FIELDS \
426  /* public */ \
427  void* data; \
428  /* read-only */ \
429  uv_loop_t* loop; \
430  uv_handle_type type; \
431  /* private */ \
432  uv_close_cb close_cb; \
433  void* handle_queue[2]; \
434  union { \
435  int fd; \
436  void* reserved[4]; \
437  } u; \
438  UV_HANDLE_PRIVATE_FIELDS \
439 
440 /* The abstract base class of all handles. */
441 struct uv_handle_s {
443 };
444 
451 
453 UV_EXTERN void* uv_req_get_data(const uv_req_t* req);
457 
459 
461 
462 /* Helpers for ad hoc debugging, no API/ABI stability guaranteed. */
465 
467 
470 
472 
473 UV_EXTERN uv_buf_t uv_buf_init(char* base, unsigned int len);
474 
475 
476 #define UV_STREAM_FIELDS \
477  /* number of bytes queued for writing */ \
478  size_t write_queue_size; \
479  uv_alloc_cb alloc_cb; \
480  uv_read_cb read_cb; \
481  /* private */ \
482  UV_STREAM_PRIVATE_FIELDS
483 
484 /*
485  * uv_stream_t is a subclass of uv_handle_t.
486  *
487  * uv_stream is an abstract class.
488  *
489  * uv_stream_t is the parent class of uv_tcp_t, uv_pipe_t and uv_tty_t.
490  */
491 struct uv_stream_s {
494 };
495 
497 
500 
505 
508  const uv_buf_t bufs[],
509  unsigned int nbufs,
510  uv_write_cb cb);
513  const uv_buf_t bufs[],
514  unsigned int nbufs,
515  uv_stream_t* send_handle,
516  uv_write_cb cb);
518  const uv_buf_t bufs[],
519  unsigned int nbufs);
520 
521 /* uv_write_t is a subclass of uv_req_t. */
522 struct uv_write_s {
525  uv_stream_t* send_handle; /* TODO: make private and unix-only in v2.x. */
528 };
529 
530 
533 
535 
537 
538 
539 /*
540  * uv_tcp_t is a subclass of uv_stream_t.
541  *
542  * Represents a TCP stream or TCP server.
543  */
544 struct uv_tcp_s {
548 };
549 
551 UV_EXTERN int uv_tcp_init_ex(uv_loop_t*, uv_tcp_t* handle, unsigned int flags);
553 UV_EXTERN int uv_tcp_nodelay(uv_tcp_t* handle, int enable);
555  int enable,
556  unsigned int delay);
558 
560  /* Used with uv_tcp_bind, when an IPv6 address is used. */
562 };
563 
565  const struct sockaddr* addr,
566  unsigned int flags);
568  struct sockaddr* name,
569  int* namelen);
571  struct sockaddr* name,
572  int* namelen);
575  uv_tcp_t* handle,
576  const struct sockaddr* addr,
577  uv_connect_cb cb);
578 
579 /* uv_connect_t is a subclass of uv_req_t. */
580 struct uv_connect_s {
585 };
586 
587 
588 /*
589  * UDP support.
590  */
591 
593  /* Disables dual stack mode. */
595  /*
596  * Indicates message was truncated because read buffer was too small. The
597  * remainder was discarded by the OS. Used in uv_udp_recv_cb.
598  */
600  /*
601  * Indicates if SO_REUSEADDR will be set when binding the handle.
602  * This sets the SO_REUSEPORT socket flag on the BSDs and OS X. On other
603  * Unix platforms, it sets the SO_REUSEADDR flag. What that means is that
604  * multiple threads or processes can bind to the same address without error
605  * (provided they all set the flag) but only the last one to bind will receive
606  * any traffic, in effect "stealing" the port from the previous listener.
607  */
609  /*
610  * Indicates that the message was received by recvmmsg, so the buffer provided
611  * must not be freed by the recv_cb callback.
612  */
614 
615  /*
616  * Indicates that recvmmsg should be used, if available.
617  */
619 };
620 
621 typedef void (*uv_udp_send_cb)(uv_udp_send_t* req, int status);
622 typedef void (*uv_udp_recv_cb)(uv_udp_t* handle,
623  ssize_t nread,
624  const uv_buf_t* buf,
625  const struct sockaddr* addr,
626  unsigned flags);
627 
628 /* uv_udp_t is a subclass of uv_handle_t. */
629 struct uv_udp_s {
631  /* read-only */
632  /*
633  * Number of bytes queued for sending. This field strictly shows how much
634  * information is currently queued.
635  */
637  /*
638  * Number of send requests currently in the queue awaiting to be processed.
639  */
642 };
643 
644 /* uv_udp_send_t is a subclass of uv_req_t. */
650 };
651 
653 UV_EXTERN int uv_udp_init_ex(uv_loop_t*, uv_udp_t* handle, unsigned int flags);
656  const struct sockaddr* addr,
657  unsigned int flags);
658 UV_EXTERN int uv_udp_connect(uv_udp_t* handle, const struct sockaddr* addr);
659 
661  struct sockaddr* name,
662  int* namelen);
664  struct sockaddr* name,
665  int* namelen);
667  const char* multicast_addr,
668  const char* interface_addr,
669  uv_membership membership);
671  const char* multicast_addr,
672  const char* interface_addr,
673  const char* source_addr,
674  uv_membership membership);
678  const char* interface_addr);
680 UV_EXTERN int uv_udp_set_ttl(uv_udp_t* handle, int ttl);
682  uv_udp_t* handle,
683  const uv_buf_t bufs[],
684  unsigned int nbufs,
685  const struct sockaddr* addr,
688  const uv_buf_t bufs[],
689  unsigned int nbufs,
690  const struct sockaddr* addr);
697 
698 
699 /*
700  * uv_tty_t is a subclass of uv_stream_t.
701  *
702  * Representing a stream for the console.
703  */
704 struct uv_tty_s {
708 };
709 
710 typedef enum {
711  /* Initial/normal terminal mode */
713  /* Raw input mode (On Windows, ENABLE_WINDOW_INPUT is also enabled) */
715  /* Binary-safe I/O mode for IPC (Unix-only) */
717 } uv_tty_mode_t;
718 
719 typedef enum {
720  /*
721  * The console supports handling of virtual terminal sequences
722  * (Windows10 new console, ConEmu)
723  */
725  /* The console cannot process the virtual terminal sequence. (Legacy
726  * console)
727  */
730 
731 
732 UV_EXTERN int uv_tty_init(uv_loop_t*, uv_tty_t*, uv_file fd, int readable);
734 UV_EXTERN int uv_tty_reset_mode(void);
738 
739 #ifdef __cplusplus
740 extern "C++" {
741 
742 inline int uv_tty_set_mode(uv_tty_t* handle, int mode) {
743  return uv_tty_set_mode(handle, static_cast<uv_tty_mode_t>(mode));
744 }
745 
746 }
747 #endif
748 
750 
751 /*
752  * uv_pipe_t is a subclass of uv_stream_t.
753  *
754  * Representing a pipe stream or pipe server. On Windows this is a Named
755  * Pipe. On Unix this is a Unix domain socket.
756  */
757 struct uv_pipe_s {
760  int ipc; /* non-zero if this pipe is used for passing handles */
762 };
763 
766 UV_EXTERN int uv_pipe_bind(uv_pipe_t* handle, const char* name);
768  uv_pipe_t* handle,
769  const char* name,
770  uv_connect_cb cb);
772  char* buffer,
773  size_t* size);
775  char* buffer,
776  size_t* size);
781 
782 
783 struct uv_poll_s {
787 };
788 
794 };
795 
798  uv_poll_t* handle,
802 
803 
804 struct uv_prepare_s {
807 };
808 
812 
813 
814 struct uv_check_s {
817 };
818 
822 
823 
824 struct uv_idle_s {
827 };
828 
832 
833 
834 struct uv_async_s {
837 };
838 
840  uv_async_t* async,
843 
844 
845 /*
846  * uv_timer_t is a subclass of uv_handle_t.
847  *
848  * Used to get woken up at a specified time in the future.
849  */
850 struct uv_timer_s {
853 };
854 
857  uv_timer_cb cb,
859  uint64_t repeat);
864 
865 
866 /*
867  * uv_getaddrinfo_t is a subclass of uv_req_t.
868  *
869  * Request object for uv_getaddrinfo.
870  */
873  /* read-only */
875  /* struct addrinfo* addrinfo is marked as private, but it really isn't. */
877 };
878 
879 
883  const char* node,
884  const char* service,
885  const struct addrinfo* hints);
886 UV_EXTERN void uv_freeaddrinfo(struct addrinfo* ai);
887 
888 
889 /*
890 * uv_getnameinfo_t is a subclass of uv_req_t.
891 *
892 * Request object for uv_getnameinfo.
893 */
896  /* read-only */
898  /* host and service are marked as private, but they really aren't. */
900 };
901 
905  const struct sockaddr* addr,
906  int flags);
907 
908 
909 /* uv_spawn() options. */
910 typedef enum {
911  UV_IGNORE = 0x00,
915 
916  /*
917  * When UV_CREATE_PIPE is specified, UV_READABLE_PIPE and UV_WRITABLE_PIPE
918  * determine the direction of flow, from the child process' perspective. Both
919  * flags may be specified to create a duplex data stream.
920  */
923 
924  /*
925  * Open the child pipe handle in overlapped mode on Windows.
926  * On Unix it is silently ignored.
927  */
930 
931 typedef struct uv_stdio_container_s {
933 
934  union {
936  int fd;
937  } data;
939 
940 typedef struct uv_process_options_s {
941  uv_exit_cb exit_cb; /* Called after the process exits. */
942  const char* file; /* Path to program to execute. */
943  /*
944  * Command line arguments. args[0] should be the path to the program. On
945  * Windows this uses CreateProcess which concatenates the arguments into a
946  * string this can cause some strange errors. See the note at
947  * windows_verbatim_arguments.
948  */
949  char** args;
950  /*
951  * This will be set as the environ variable in the subprocess. If this is
952  * NULL then the parents environ will be used.
953  */
954  char** env;
955  /*
956  * If non-null this represents a directory the subprocess should execute
957  * in. Stands for current working directory.
958  */
959  const char* cwd;
960  /*
961  * Various flags that control how uv_spawn() behaves. See the definition of
962  * `enum uv_process_flags` below.
963  */
964  unsigned int flags;
965  /*
966  * The `stdio` field points to an array of uv_stdio_container_t structs that
967  * describe the file descriptors that will be made available to the child
968  * process. The convention is that stdio[0] points to stdin, fd 1 is used for
969  * stdout, and fd 2 is stderr.
970  *
971  * Note that on windows file descriptors greater than 2 are available to the
972  * child process only if the child processes uses the MSVCRT runtime.
973  */
976  /*
977  * Libuv can change the child process' user/group id. This happens only when
978  * the appropriate bits are set in the flags fields. This is not supported on
979  * windows; uv_spawn() will fail and set the error to UV_ENOTSUP.
980  */
984 
985 /*
986  * These are the flags that can be used for the uv_process_options.flags field.
987  */
989  /*
990  * Set the child process' user id. The user id is supplied in the `uid` field
991  * of the options struct. This does not work on windows; setting this flag
992  * will cause uv_spawn() to fail.
993  */
994  UV_PROCESS_SETUID = (1 << 0),
995  /*
996  * Set the child process' group id. The user id is supplied in the `gid`
997  * field of the options struct. This does not work on windows; setting this
998  * flag will cause uv_spawn() to fail.
999  */
1000  UV_PROCESS_SETGID = (1 << 1),
1001  /*
1002  * Do not wrap any arguments in quotes, or perform any other escaping, when
1003  * converting the argument list into a command line string. This option is
1004  * only meaningful on Windows systems. On Unix it is silently ignored.
1005  */
1007  /*
1008  * Spawn the child process in a detached state - this will make it a process
1009  * group leader, and will effectively enable the child to keep running after
1010  * the parent exits. Note that the child process will still keep the
1011  * parent's event loop alive unless the parent process calls uv_unref() on
1012  * the child's process handle.
1013  */
1015  /*
1016  * Hide the subprocess window that would normally be created. This option is
1017  * only meaningful on Windows systems. On Unix it is silently ignored.
1018  */
1020  /*
1021  * Hide the subprocess console window that would normally be created. This
1022  * option is only meaningful on Windows systems. On Unix it is silently
1023  * ignored.
1024  */
1026  /*
1027  * Hide the subprocess GUI window that would normally be created. This
1028  * option is only meaningful on Windows systems. On Unix it is silently
1029  * ignored.
1030  */
1032 };
1033 
1034 /*
1035  * uv_process_t is a subclass of uv_handle_t.
1036  */
1040  int pid;
1042 };
1043 
1046  const uv_process_options_t* options);
1047 UV_EXTERN int uv_process_kill(uv_process_t*, int signum);
1048 UV_EXTERN int uv_kill(int pid, int signum);
1050 
1051 
1052 /*
1053  * uv_work_t is a subclass of uv_req_t.
1054  */
1055 struct uv_work_s {
1061 };
1062 
1064  uv_work_t* req,
1067 
1069 
1070 
1077 };
1078 
1080  char* model;
1081  int speed;
1083 };
1084 
1086  char* name;
1087  char phys_addr[6];
1089  union {
1090  struct sockaddr_in address4;
1092  } address;
1093  union {
1094  struct sockaddr_in netmask4;
1096  } netmask;
1097 };
1098 
1099 struct uv_passwd_s {
1100  char* username;
1101  long uid;
1102  long gid;
1103  char* shell;
1104  char* homedir;
1105 };
1106 
1108  char sysname[256];
1109  char release[256];
1110  char version[256];
1111  char machine[256];
1112  /* This struct does not contain the nodename and domainname fields present in
1113  the utsname type. domainname is a GNU extension. Both fields are referred
1114  to as meaningless in the docs. */
1115 };
1116 
1117 struct uv_statfs_s {
1126 };
1127 
1128 typedef enum {
1138 
1139 struct uv_dirent_s {
1140  const char* name;
1142 };
1143 
1144 UV_EXTERN char** uv_setup_args(int argc, char** argv);
1145 UV_EXTERN int uv_get_process_title(char* buffer, size_t size);
1146 UV_EXTERN int uv_set_process_title(const char* title);
1147 UV_EXTERN int uv_resident_set_memory(size_t* rss);
1148 UV_EXTERN int uv_uptime(double* uptime);
1151 
1152 typedef struct {
1153  long tv_sec;
1154  long tv_usec;
1155 } uv_timeval_t;
1156 
1157 typedef struct {
1160 } uv_timeval64_t;
1161 
1162 typedef struct {
1163  uv_timeval_t ru_utime; /* user CPU time used */
1164  uv_timeval_t ru_stime; /* system CPU time used */
1165  uint64_t ru_maxrss; /* maximum resident set size */
1166  uint64_t ru_ixrss; /* integral shared memory size */
1167  uint64_t ru_idrss; /* integral unshared data size */
1168  uint64_t ru_isrss; /* integral unshared stack size */
1169  uint64_t ru_minflt; /* page reclaims (soft page faults) */
1170  uint64_t ru_majflt; /* page faults (hard page faults) */
1171  uint64_t ru_nswap; /* swaps */
1172  uint64_t ru_inblock; /* block input operations */
1173  uint64_t ru_oublock; /* block output operations */
1174  uint64_t ru_msgsnd; /* IPC messages sent */
1175  uint64_t ru_msgrcv; /* IPC messages received */
1176  uint64_t ru_nsignals; /* signals received */
1177  uint64_t ru_nvcsw; /* voluntary context switches */
1178  uint64_t ru_nivcsw; /* involuntary context switches */
1179 } uv_rusage_t;
1180 
1181 UV_EXTERN int uv_getrusage(uv_rusage_t* rusage);
1182 
1183 UV_EXTERN int uv_os_homedir(char* buffer, size_t* size);
1184 UV_EXTERN int uv_os_tmpdir(char* buffer, size_t* size);
1189 
1190 #if defined(__PASE__)
1191 /* On IBM i PASE, the highest process priority is -10 */
1192 # define UV_PRIORITY_LOW 39 // RUNPTY(99)
1193 # define UV_PRIORITY_BELOW_NORMAL 15 // RUNPTY(50)
1194 # define UV_PRIORITY_NORMAL 0 // RUNPTY(20)
1195 # define UV_PRIORITY_ABOVE_NORMAL -4 // RUNTY(12)
1196 # define UV_PRIORITY_HIGH -7 // RUNPTY(6)
1197 # define UV_PRIORITY_HIGHEST -10 // RUNPTY(1)
1198 #else
1199 # define UV_PRIORITY_LOW 19
1200 # define UV_PRIORITY_BELOW_NORMAL 10
1201 # define UV_PRIORITY_NORMAL 0
1202 # define UV_PRIORITY_ABOVE_NORMAL -7
1203 # define UV_PRIORITY_HIGH -14
1204 # define UV_PRIORITY_HIGHEST -20
1205 #endif
1206 
1209 
1210 UV_EXTERN int uv_cpu_info(uv_cpu_info_t** cpu_infos, int* count);
1211 UV_EXTERN void uv_free_cpu_info(uv_cpu_info_t* cpu_infos, int count);
1212 
1214  int* count);
1216  int count);
1217 
1219  char* name;
1220  char* value;
1221 };
1222 
1223 UV_EXTERN int uv_os_environ(uv_env_item_t** envitems, int* count);
1224 UV_EXTERN void uv_os_free_environ(uv_env_item_t* envitems, int count);
1225 UV_EXTERN int uv_os_getenv(const char* name, char* buffer, size_t* size);
1226 UV_EXTERN int uv_os_setenv(const char* name, const char* value);
1227 UV_EXTERN int uv_os_unsetenv(const char* name);
1228 
1229 #ifdef MAXHOSTNAMELEN
1230 # define UV_MAXHOSTNAMESIZE (MAXHOSTNAMELEN + 1)
1231 #else
1232  /*
1233  Fallback for the maximum hostname size, including the null terminator. The
1234  Windows gethostname() documentation states that 256 bytes will always be
1235  large enough to hold the null-terminated hostname.
1236  */
1237 # define UV_MAXHOSTNAMESIZE 256
1238 #endif
1239 
1240 UV_EXTERN int uv_os_gethostname(char* buffer, size_t* size);
1241 
1243 
1244 
1245 typedef enum {
1284 } uv_fs_type;
1285 
1286 struct uv_dir_s {
1288  size_t nentries;
1289  void* reserved[4];
1291 };
1292 
1293 /* uv_fs_t is a subclass of uv_req_t. */
1294 struct uv_fs_s {
1300  void* ptr;
1301  const char* path;
1302  uv_stat_t statbuf; /* Stores the result of uv_fs_stat() and uv_fs_fstat(). */
1304 };
1305 
1308 UV_EXTERN void* uv_fs_get_ptr(const uv_fs_t*);
1309 UV_EXTERN const char* uv_fs_get_path(const uv_fs_t*);
1311 
1314  uv_fs_t* req,
1315  uv_file file,
1316  uv_fs_cb cb);
1318  uv_fs_t* req,
1319  const char* path,
1320  int flags,
1321  int mode,
1322  uv_fs_cb cb);
1324  uv_fs_t* req,
1325  uv_file file,
1326  const uv_buf_t bufs[],
1327  unsigned int nbufs,
1328  int64_t offset,
1329  uv_fs_cb cb);
1331  uv_fs_t* req,
1332  const char* path,
1333  uv_fs_cb cb);
1335  uv_fs_t* req,
1336  uv_file file,
1337  const uv_buf_t bufs[],
1338  unsigned int nbufs,
1339  int64_t offset,
1340  uv_fs_cb cb);
1341 /*
1342  * This flag can be used with uv_fs_copyfile() to return an error if the
1343  * destination already exists.
1344  */
1345 #define UV_FS_COPYFILE_EXCL 0x0001
1346 
1347 /*
1348  * This flag can be used with uv_fs_copyfile() to attempt to create a reflink.
1349  * If copy-on-write is not supported, a fallback copy mechanism is used.
1350  */
1351 #define UV_FS_COPYFILE_FICLONE 0x0002
1352 
1353 /*
1354  * This flag can be used with uv_fs_copyfile() to attempt to create a reflink.
1355  * If copy-on-write is not supported, an error is returned.
1356  */
1357 #define UV_FS_COPYFILE_FICLONE_FORCE 0x0004
1358 
1360  uv_fs_t* req,
1361  const char* path,
1362  const char* new_path,
1363  int flags,
1364  uv_fs_cb cb);
1366  uv_fs_t* req,
1367  const char* path,
1368  int mode,
1369  uv_fs_cb cb);
1371  uv_fs_t* req,
1372  const char* tpl,
1373  uv_fs_cb cb);
1375  uv_fs_t* req,
1376  const char* tpl,
1377  uv_fs_cb cb);
1379  uv_fs_t* req,
1380  const char* path,
1381  uv_fs_cb cb);
1383  uv_fs_t* req,
1384  const char* path,
1385  int flags,
1386  uv_fs_cb cb);
1388  uv_dirent_t* ent);
1390  uv_fs_t* req,
1391  const char* path,
1392  uv_fs_cb cb);
1394  uv_fs_t* req,
1395  uv_dir_t* dir,
1396  uv_fs_cb cb);
1398  uv_fs_t* req,
1399  uv_dir_t* dir,
1400  uv_fs_cb cb);
1402  uv_fs_t* req,
1403  const char* path,
1404  uv_fs_cb cb);
1406  uv_fs_t* req,
1407  uv_file file,
1408  uv_fs_cb cb);
1410  uv_fs_t* req,
1411  const char* path,
1412  const char* new_path,
1413  uv_fs_cb cb);
1415  uv_fs_t* req,
1416  uv_file file,
1417  uv_fs_cb cb);
1419  uv_fs_t* req,
1420  uv_file file,
1421  uv_fs_cb cb);
1423  uv_fs_t* req,
1424  uv_file file,
1425  int64_t offset,
1426  uv_fs_cb cb);
1428  uv_fs_t* req,
1429  uv_file out_fd,
1430  uv_file in_fd,
1431  int64_t in_offset,
1432  size_t length,
1433  uv_fs_cb cb);
1435  uv_fs_t* req,
1436  const char* path,
1437  int mode,
1438  uv_fs_cb cb);
1440  uv_fs_t* req,
1441  const char* path,
1442  int mode,
1443  uv_fs_cb cb);
1445  uv_fs_t* req,
1446  const char* path,
1447  double atime,
1448  double mtime,
1449  uv_fs_cb cb);
1451  uv_fs_t* req,
1452  uv_file file,
1453  double atime,
1454  double mtime,
1455  uv_fs_cb cb);
1457  uv_fs_t* req,
1458  const char* path,
1459  double atime,
1460  double mtime,
1461  uv_fs_cb cb);
1463  uv_fs_t* req,
1464  const char* path,
1465  uv_fs_cb cb);
1467  uv_fs_t* req,
1468  const char* path,
1469  const char* new_path,
1470  uv_fs_cb cb);
1471 
1472 /*
1473  * This flag can be used with uv_fs_symlink() on Windows to specify whether
1474  * path argument points to a directory.
1475  */
1476 #define UV_FS_SYMLINK_DIR 0x0001
1477 
1478 /*
1479  * This flag can be used with uv_fs_symlink() on Windows to specify whether
1480  * the symlink is to be created using junction points.
1481  */
1482 #define UV_FS_SYMLINK_JUNCTION 0x0002
1483 
1485  uv_fs_t* req,
1486  const char* path,
1487  const char* new_path,
1488  int flags,
1489  uv_fs_cb cb);
1491  uv_fs_t* req,
1492  const char* path,
1493  uv_fs_cb cb);
1495  uv_fs_t* req,
1496  const char* path,
1497  uv_fs_cb cb);
1499  uv_fs_t* req,
1500  uv_file file,
1501  int mode,
1502  uv_fs_cb cb);
1504  uv_fs_t* req,
1505  const char* path,
1506  uv_uid_t uid,
1507  uv_gid_t gid,
1508  uv_fs_cb cb);
1510  uv_fs_t* req,
1511  uv_file file,
1512  uv_uid_t uid,
1513  uv_gid_t gid,
1514  uv_fs_cb cb);
1516  uv_fs_t* req,
1517  const char* path,
1518  uv_uid_t uid,
1519  uv_gid_t gid,
1520  uv_fs_cb cb);
1522  uv_fs_t* req,
1523  const char* path,
1524  uv_fs_cb cb);
1525 
1526 
1530 };
1531 
1532 
1535  /* private */
1536  char* path;
1538 };
1539 
1540 
1541 /*
1542  * uv_fs_stat() based polling file watcher.
1543  */
1546  /* Private, don't touch. */
1547  void* poll_ctx;
1548 };
1549 
1553  const char* path,
1554  unsigned int interval);
1557  char* buffer,
1558  size_t* size);
1559 
1560 
1561 struct uv_signal_s {
1564  int signum;
1566 };
1567 
1571  int signum);
1574  int signum);
1576 
1577 UV_EXTERN void uv_loadavg(double avg[3]);
1578 
1579 
1580 /*
1581  * Flags to be passed to uv_fs_event_start().
1582  */
1584  /*
1585  * By default, if the fs event watcher is given a directory name, we will
1586  * watch for all events in that directory. This flags overrides this behavior
1587  * and makes fs_event report only changes to the directory entry itself. This
1588  * flag does not affect individual files watched.
1589  * This flag is currently not implemented yet on any backend.
1590  */
1592 
1593  /*
1594  * By default uv_fs_event will try to use a kernel interface such as inotify
1595  * or kqueue to detect events. This may not work on remote filesystems such
1596  * as NFS mounts. This flag makes fs_event fall back to calling stat() on a
1597  * regular interval.
1598  * This flag is currently not implemented yet on any backend.
1599  */
1601 
1602  /*
1603  * By default, event watcher, when watching directory, is not registering
1604  * (is ignoring) changes in it's subdirectories.
1605  * This flag will override this behaviour on platforms that support it.
1606  */
1608 };
1609 
1610 
1614  const char* path,
1615  unsigned int flags);
1618  char* buffer,
1619  size_t* size);
1620 
1621 UV_EXTERN int uv_ip4_addr(const char* ip, int port, struct sockaddr_in* addr);
1622 UV_EXTERN int uv_ip6_addr(const char* ip, int port, struct sockaddr_in6* addr);
1623 
1624 UV_EXTERN int uv_ip4_name(const struct sockaddr_in* src, char* dst, size_t size);
1625 UV_EXTERN int uv_ip6_name(const struct sockaddr_in6* src, char* dst, size_t size);
1626 
1627 UV_EXTERN int uv_inet_ntop(int af, const void* src, char* dst, size_t size);
1628 UV_EXTERN int uv_inet_pton(int af, const char* src, void* dst);
1629 
1630 
1631 struct uv_random_s {
1633  /* read-only */
1635  /* private */
1636  int status;
1637  void* buf;
1638  size_t buflen;
1641 };
1642 
1644  uv_random_t* req,
1645  void *buf,
1646  size_t buflen,
1647  unsigned flags, /* For future extension; must be 0. */
1648  uv_random_cb cb);
1649 
1650 #if defined(IF_NAMESIZE)
1651 # define UV_IF_NAMESIZE (IF_NAMESIZE + 1)
1652 #elif defined(IFNAMSIZ)
1653 # define UV_IF_NAMESIZE (IFNAMSIZ + 1)
1654 #else
1655 # define UV_IF_NAMESIZE (16 + 1)
1656 #endif
1657 
1658 UV_EXTERN int uv_if_indextoname(unsigned int ifindex,
1659  char* buffer,
1660  size_t* size);
1661 UV_EXTERN int uv_if_indextoiid(unsigned int ifindex,
1662  char* buffer,
1663  size_t* size);
1664 
1665 UV_EXTERN int uv_exepath(char* buffer, size_t* size);
1666 
1667 UV_EXTERN int uv_cwd(char* buffer, size_t* size);
1668 
1669 UV_EXTERN int uv_chdir(const char* dir);
1670 
1674 
1676 UV_EXTERN void uv_sleep(unsigned int msec);
1677 
1679 
1680 UV_EXTERN int uv_dlopen(const char* filename, uv_lib_t* lib);
1681 UV_EXTERN void uv_dlclose(uv_lib_t* lib);
1682 UV_EXTERN int uv_dlsym(uv_lib_t* lib, const char* name, void** ptr);
1683 UV_EXTERN const char* uv_dlerror(const uv_lib_t* lib);
1684 
1691 
1700 
1701 UV_EXTERN int uv_sem_init(uv_sem_t* sem, unsigned int value);
1706 
1711 
1712 UV_EXTERN int uv_barrier_init(uv_barrier_t* barrier, unsigned int count);
1714 UV_EXTERN int uv_barrier_wait(uv_barrier_t* barrier);
1715 
1718  uv_mutex_t* mutex,
1719  uint64_t timeout);
1720 
1721 UV_EXTERN void uv_once(uv_once_t* guard, void (*callback)(void));
1722 
1726 UV_EXTERN void uv_key_set(uv_key_t* key, void* value);
1727 
1729 
1730 typedef void (*uv_thread_cb)(void* arg);
1731 
1733 
1734 typedef enum {
1738 
1740  unsigned int flags;
1741  size_t stack_size;
1742  /* More fields may be added at any time. */
1743 };
1744 
1746 
1748  const uv_thread_options_t* params,
1749  uv_thread_cb entry,
1750  void* arg);
1753 UV_EXTERN int uv_thread_equal(const uv_thread_t* t1, const uv_thread_t* t2);
1754 
1755 /* The presence of these unions force similar struct layout. */
1756 #define XX(_, name) uv_ ## name ## _t name;
1759 };
1760 
1761 union uv_any_req {
1763 };
1764 #undef XX
1765 
1766 
1767 struct uv_loop_s {
1768  /* User data - use this for whatever. */
1769  void* data;
1770  /* Loop reference counting. */
1771  unsigned int active_handles;
1772  void* handle_queue[2];
1773  union {
1774  void* unused[2];
1775  unsigned int count;
1776  } active_reqs;
1777  /* Internal flag to signal loop stop. */
1778  unsigned int stop_flag;
1780 };
1781 
1782 UV_EXTERN void* uv_loop_get_data(const uv_loop_t*);
1784 
1785 /* Don't export the private CPP symbols. */
1786 #undef UV_HANDLE_TYPE_PRIVATE
1787 #undef UV_REQ_TYPE_PRIVATE
1788 #undef UV_REQ_PRIVATE_FIELDS
1789 #undef UV_STREAM_PRIVATE_FIELDS
1790 #undef UV_TCP_PRIVATE_FIELDS
1791 #undef UV_PREPARE_PRIVATE_FIELDS
1792 #undef UV_CHECK_PRIVATE_FIELDS
1793 #undef UV_IDLE_PRIVATE_FIELDS
1794 #undef UV_ASYNC_PRIVATE_FIELDS
1795 #undef UV_TIMER_PRIVATE_FIELDS
1796 #undef UV_GETADDRINFO_PRIVATE_FIELDS
1797 #undef UV_GETNAMEINFO_PRIVATE_FIELDS
1798 #undef UV_FS_REQ_PRIVATE_FIELDS
1799 #undef UV_WORK_PRIVATE_FIELDS
1800 #undef UV_FS_EVENT_PRIVATE_FIELDS
1801 #undef UV_SIGNAL_PRIVATE_FIELDS
1802 #undef UV_LOOP_PRIVATE_FIELDS
1803 #undef UV_LOOP_PRIVATE_PLATFORM_FIELDS
1804 #undef UV__ERR
1805 
1806 #ifdef __cplusplus
1807 }
1808 #endif
1809 #endif /* UV_H */
uv_if_indextoname
UV_EXTERN int uv_if_indextoname(unsigned int ifindex, char *buffer, size_t *size)
Definition: unix/getaddrinfo.c:229
uv_udp_set_multicast_ttl
UV_EXTERN int uv_udp_set_multicast_ttl(uv_udp_t *handle, int ttl)
Definition: unix/udp.c:1185
uv_rwlock_tryrdlock
UV_EXTERN int uv_rwlock_tryrdlock(uv_rwlock_t *rwlock)
Definition: libuv/src/unix/thread.c:372
UV_FS_FCHOWN
@ UV_FS_FCHOWN
Definition: uv.h:1274
uv_os_free_passwd
UV_EXTERN void uv_os_free_passwd(uv_passwd_t *pwd)
Definition: unix/core.c:1223
uv_pipe_pending_count
UV_EXTERN int uv_pipe_pending_count(uv_pipe_t *handle)
Definition: unix/pipe.c:298
uv_udp_set_broadcast
UV_EXTERN int uv_udp_set_broadcast(uv_udp_t *handle, int on)
Definition: unix/udp.c:1135
ptr
char * ptr
Definition: abseil-cpp/absl/base/internal/low_level_alloc_test.cc:45
async_greeter_server_with_graceful_shutdown.loop
loop
Definition: async_greeter_server_with_graceful_shutdown.py:59
uv_stat_t::st_rdev
uint64_t st_rdev
Definition: uv.h:352
UV_DIRENT_LINK
@ UV_DIRENT_LINK
Definition: uv.h:1132
uv_cpu_times_s::irq
uint64_t irq
Definition: uv.h:1076
sem
static uv_sem_t sem
Definition: test-signal-multiple-loops.c:52
uv_fs_event_s
Definition: uv.h:1533
uv_fs_poll_init
UV_EXTERN int uv_fs_poll_init(uv_loop_t *loop, uv_fs_poll_t *handle)
Definition: fs-poll.c:59
UV_TTY_PRIVATE_FIELDS
#define UV_TTY_PRIVATE_FIELDS
Definition: unix.h:377
uv_fs_access
UV_EXTERN int uv_fs_access(uv_loop_t *loop, uv_fs_t *req, const char *path, int mode, uv_fs_cb cb)
Definition: unix/fs.c:1613
uv_process_options_s
Definition: uv.h:940
uv_fs_rmdir
UV_EXTERN int uv_fs_rmdir(uv_loop_t *loop, uv_fs_t *req, const char *path, uv_fs_cb cb)
Definition: unix/fs.c:1931
uv_fs_s::statbuf
uv_stat_t statbuf
Definition: uv.h:1302
width
int width
Definition: libuv/docs/code/tty-gravity/main.c:10
UV_DIRENT_BLOCK
@ UV_DIRENT_BLOCK
Definition: uv.h:1136
uv_statfs_s::f_blocks
uint64_t f_blocks
Definition: uv.h:1120
uv_env_item_s::value
char * value
Definition: uv.h:1220
uv_ip6_addr
UV_EXTERN int uv_ip6_addr(const char *ip, int port, struct sockaddr_in6 *addr)
Definition: uv-common.c:232
uv_guess_handle
UV_EXTERN uv_handle_type uv_guess_handle(uv_file file)
Definition: unix/tty.c:315
UV_FS_UTIME
@ UV_FS_UTIME
Definition: uv.h:1257
filename
const char * filename
Definition: bloaty/third_party/zlib/contrib/minizip/ioapi.h:135
uv_inet_pton
UV_EXTERN int uv_inet_pton(int af, const char *src, void *dst)
Definition: inet.c:150
uv__work
Definition: third_party/libuv/include/uv/threadpool.h:30
dst
static const char dst[]
Definition: test-fs-copyfile.c:37
uv_os_setenv
UV_EXTERN int uv_os_setenv(const char *name, const char *value)
Definition: unix/core.c:1332
uv_calloc_func
void *(* uv_calloc_func)(size_t count, size_t size)
Definition: uv.h:265
uv_loop_size
UV_EXTERN size_t uv_loop_size(void)
Definition: uv-common.c:152
uv_req_type
uv_req_type
Definition: uv.h:198
uv_udp_flags
uv_udp_flags
Definition: uv.h:592
uv_process_s
Definition: uv.h:1037
uv_rusage_t::ru_stime
uv_timeval_t ru_stime
Definition: uv.h:1164
UV_FS_CLOSE
@ UV_FS_CLOSE
Definition: uv.h:1249
uv_tty_vtermstate_t
uv_tty_vtermstate_t
Definition: uv.h:719
uv_rusage_t::ru_idrss
uint64_t ru_idrss
Definition: uv.h:1167
uv_process_options_s::cwd
const char * cwd
Definition: uv.h:959
uv_sem_trywait
UV_EXTERN int uv_sem_trywait(uv_sem_t *sem)
Definition: libuv/src/unix/thread.c:685
idle
static uv_idle_t idle
Definition: test-poll-oob.c:37
uv_strerror_r
UV_EXTERN char * uv_strerror_r(int err, char *buf, size_t buflen)
Definition: uv-common.c:201
UV_TTY_UNSUPPORTED
@ UV_TTY_UNSUPPORTED
Definition: uv.h:728
uv_signal_s::signal_cb
UV_HANDLE_FIELDS uv_signal_cb signal_cb
Definition: uv.h:1563
uv_utsname_s::sysname
char sysname[256]
Definition: uv.h:1108
uv_work_s::work_cb
uv_work_cb work_cb
Definition: uv.h:1058
uv_realloc_func
void *(* uv_realloc_func)(void *ptr, size_t size)
Definition: uv.h:264
uv_statfs_s::f_files
uint64_t f_files
Definition: uv.h:1123
uv_rusage_t
Definition: uv.h:1162
UV_FS_READ
@ UV_FS_READ
Definition: uv.h:1250
uv_fs_open
UV_EXTERN int uv_fs_open(uv_loop_t *loop, uv_fs_t *req, const char *path, int flags, int mode, uv_fs_cb cb)
Definition: unix/fs.c:1812
uv_timer_get_repeat
UV_EXTERN uint64_t uv_timer_get_repeat(const uv_timer_t *handle)
Definition: timer.c:128
UV_PROCESS_PRIVATE_FIELDS
#define UV_PROCESS_PRIVATE_FIELDS
Definition: unix.h:355
uv_prepare_init
UV_EXTERN int uv_prepare_init(uv_loop_t *, uv_prepare_t *prepare)
uv_timer_again
UV_EXTERN int uv_timer_again(uv_timer_t *handle)
Definition: timer.c:110
priority
int priority
Definition: abseil-cpp/absl/synchronization/internal/graphcycles.cc:286
read_cb
static void read_cb(uv_stream_t *stream, ssize_t nread, const uv_buf_t *buf)
Definition: benchmark-pound.c:138
uv_passwd_s
Definition: uv.h:1099
uv_fs_symlink
UV_EXTERN int uv_fs_symlink(uv_loop_t *loop, uv_fs_t *req, const char *path, const char *new_path, int flags, uv_fs_cb cb)
Definition: unix/fs.c:1961
UV_TTY_MODE_NORMAL
@ UV_TTY_MODE_NORMAL
Definition: uv.h:712
UV_THREAD_NO_FLAGS
@ UV_THREAD_NO_FLAGS
Definition: uv.h:1735
uv_loop_s::active_handles
unsigned int active_handles
Definition: uv.h:1771
uv_cpu_info_s
Definition: uv.h:1079
UV_PRIORITIZED
@ UV_PRIORITIZED
Definition: uv.h:793
uv_signal_cb
void(* uv_signal_cb)(uv_signal_t *handle, int signum)
Definition: uv.h:376
uv_pipe_connect
UV_EXTERN void uv_pipe_connect(uv_connect_t *req, uv_pipe_t *handle, const char *name, uv_connect_cb cb)
Definition: unix/pipe.c:173
uv_fs_copyfile
UV_EXTERN int uv_fs_copyfile(uv_loop_t *loop, uv_fs_t *req, const char *path, const char *new_path, int flags, uv_fs_cb cb)
Definition: unix/fs.c:2057
uv_process_options_s::gid
uv_gid_t gid
Definition: uv.h:982
uv_cpu_info
UV_EXTERN int uv_cpu_info(uv_cpu_info_t **cpu_infos, int *count)
Definition: aix.c:986
uv_statfs_s::f_bavail
uint64_t f_bavail
Definition: uv.h:1122
UV_READABLE_PIPE
@ UV_READABLE_PIPE
Definition: uv.h:921
uv_pipe_init
UV_EXTERN int uv_pipe_init(uv_loop_t *, uv_pipe_t *handle, int ipc)
Definition: unix/pipe.c:33
UV_PROCESS_SETUID
@ UV_PROCESS_SETUID
Definition: uv.h:994
uv_handle_type
uv_handle_type
Definition: uv.h:189
uv_get_free_memory
UV_EXTERN uint64_t uv_get_free_memory(void)
Definition: aix.c:327
uv_random_s::loop
UV_REQ_FIELDS uv_loop_t * loop
Definition: uv.h:1634
uv_connect_s
Definition: uv.h:580
uv_now
UV_EXTERN uint64_t uv_now(const uv_loop_t *)
Definition: uv-common.c:537
uv_disable_stdio_inheritance
UV_EXTERN void uv_disable_stdio_inheritance(void)
Definition: unix/core.c:743
uv_poll_event
uv_poll_event
Definition: uv.h:789
UV_UDP_PARTIAL
@ UV_UDP_PARTIAL
Definition: uv.h:599
UV_FS_MKDTEMP
@ UV_FS_MKDTEMP
Definition: uv.h:1267
mutex
static uv_mutex_t mutex
Definition: threadpool.c:34
UV_DIRENT_FILE
@ UV_DIRENT_FILE
Definition: uv.h:1130
uv_dir_s
Definition: uv.h:1286
XX
#define XX(code, _)
Definition: uv.h:1756
UV_WRITABLE
@ UV_WRITABLE
Definition: uv.h:791
uv_prepare_s
Definition: uv.h:804
uv_fs_get_result
UV_EXTERN ssize_t uv_fs_get_result(const uv_fs_t *)
Definition: uv-data-getter-setters.c:76
uv_free_cpu_info
UV_EXTERN void uv_free_cpu_info(uv_cpu_info_t *cpu_infos, int count)
Definition: uv-common.c:816
UV_FS_CUSTOM
@ UV_FS_CUSTOM
Definition: uv.h:1247
uv_poll_init_socket
UV_EXTERN int uv_poll_init_socket(uv_loop_t *loop, uv_poll_t *handle, uv_os_sock_t socket)
Definition: unix/poll.c:96
uv_kill
UV_EXTERN int uv_kill(int pid, int signum)
Definition: unix/process.c:582
UV_IGNORE
@ UV_IGNORE
Definition: uv.h:911
UV_RUN_NOWAIT
@ UV_RUN_NOWAIT
Definition: uv.h:256
uv_loop_s::handle_queue
void * handle_queue[2]
Definition: uv.h:1772
uv_os_getpid
UV_EXTERN uv_pid_t uv_os_getpid(void)
Definition: unix/core.c:1392
uv_handle_type_name
const UV_EXTERN char * uv_handle_type_name(uv_handle_type type)
Definition: uv-data-getter-setters.c:3
uv_passwd_s::username
char * username
Definition: uv.h:1100
unix.h
uv_loop_set_data
UV_EXTERN void uv_loop_set_data(uv_loop_t *, void *data)
Definition: uv-data-getter-setters.c:96
uv_timeval_t
Definition: uv.h:1152
uv_shutdown_s
Definition: uv.h:417
uv_mutex_init
UV_EXTERN int uv_mutex_init(uv_mutex_t *handle)
Definition: libuv/src/unix/thread.c:281
UV_TTY_MODE_RAW
@ UV_TTY_MODE_RAW
Definition: uv.h:714
client
Definition: examples/python/async_streaming/client.py:1
uv_fs_stat
UV_EXTERN int uv_fs_stat(uv_loop_t *loop, uv_fs_t *req, const char *path, uv_fs_cb cb)
Definition: unix/fs.c:1954
UV_PREPARE_PRIVATE_FIELDS
#define UV_PREPARE_PRIVATE_FIELDS
Definition: unix.h:313
uv_getaddrinfo_s
Definition: uv.h:871
uv_passwd_s::gid
long gid
Definition: uv.h:1102
uv_tcp_keepalive
UV_EXTERN int uv_tcp_keepalive(uv_tcp_t *handle, int enable, unsigned int delay)
Definition: unix/tcp.c:425
uv_poll_init
UV_EXTERN int uv_poll_init(uv_loop_t *loop, uv_poll_t *handle, int fd)
Definition: unix/poll.c:68
uv_signal_init
UV_EXTERN int uv_signal_init(uv_loop_t *loop, uv_signal_t *handle)
Definition: unix/signal.c:317
uv_passwd_s::homedir
char * homedir
Definition: uv.h:1104
options
double_dict options[]
Definition: capstone_test.c:55
uv_os_get_passwd
UV_EXTERN int uv_os_get_passwd(uv_passwd_t *pwd)
Definition: unix/core.c:1239
UV_THREAD_HAS_STACK_SIZE
@ UV_THREAD_HAS_STACK_SIZE
Definition: uv.h:1736
uv_fs_sendfile
UV_EXTERN int uv_fs_sendfile(uv_loop_t *loop, uv_fs_t *req, uv_file out_fd, uv_file in_fd, int64_t in_offset, size_t length, uv_fs_cb cb)
Definition: unix/fs.c:1938
uv_timeval64_t::tv_sec
int64_t tv_sec
Definition: uv.h:1158
uv_stat_t::st_mtim
uv_timespec_t st_mtim
Definition: uv.h:360
uv_os_getenv
UV_EXTERN int uv_os_getenv(const char *name, char *buffer, size_t *size)
Definition: unix/core.c:1306
uv_pid_t
pid_t uv_pid_t
Definition: unix.h:129
uv_tty_s
Definition: uv.h:704
buf
voidpf void * buf
Definition: bloaty/third_party/zlib/contrib/minizip/ioapi.h:136
UV_FS_MKSTEMP
@ UV_FS_MKSTEMP
Definition: uv.h:1282
uv_listen
UV_EXTERN int uv_listen(uv_stream_t *stream, int backlog, uv_connection_cb cb)
Definition: unix/stream.c:656
uv_barrier_destroy
UV_EXTERN void uv_barrier_destroy(uv_barrier_t *barrier)
Definition: libuv/src/unix/thread.c:118
uv_pipe_getpeername
UV_EXTERN int uv_pipe_getpeername(const uv_pipe_t *handle, char *buffer, size_t *size)
Definition: unix/pipe.c:289
uv_mutex_destroy
UV_EXTERN void uv_mutex_destroy(uv_mutex_t *handle)
Definition: libuv/src/unix/thread.c:323
UV_UDP_IPV6ONLY
@ UV_UDP_IPV6ONLY
Definition: uv.h:594
uv_tcp_simultaneous_accepts
UV_EXTERN int uv_tcp_simultaneous_accepts(uv_tcp_t *handle, int enable)
Definition: unix/tcp.c:447
uv_connect_s::handle
uv_stream_t * handle
Definition: uv.h:583
uv_udp_send
UV_EXTERN int uv_udp_send(uv_udp_send_t *req, uv_udp_t *handle, const uv_buf_t bufs[], unsigned int nbufs, const struct sockaddr *addr, uv_udp_send_cb send_cb)
Definition: uv-common.c:408
uv_process_options_s::exit_cb
uv_exit_cb exit_cb
Definition: uv.h:941
uv_send_buffer_size
UV_EXTERN int uv_send_buffer_size(uv_handle_t *handle, int *value)
Definition: uv-common.c:558
UV_OVERLAPPED_PIPE
@ UV_OVERLAPPED_PIPE
Definition: uv.h:928
uv_prepare_stop
UV_EXTERN int uv_prepare_stop(uv_prepare_t *prepare)
uv_fs_readdir
UV_EXTERN int uv_fs_readdir(uv_loop_t *loop, uv_fs_t *req, uv_dir_t *dir, uv_fs_cb cb)
Definition: unix/fs.c:1874
error_ref_leak.err
err
Definition: error_ref_leak.py:35
uv_fs_lutime
UV_EXTERN int uv_fs_lutime(uv_loop_t *loop, uv_fs_t *req, const char *path, double atime, double mtime, uv_fs_cb cb)
Definition: unix/fs.c:1744
uv_fs_readlink
UV_EXTERN int uv_fs_readlink(uv_loop_t *loop, uv_fs_t *req, const char *path, uv_fs_cb cb)
Definition: unix/fs.c:1900
UV_FS_FSYNC
@ UV_FS_FSYNC
Definition: uv.h:1262
uv_timespec_t::tv_sec
long tv_sec
Definition: uv.h:341
uv_stat_t::st_size
uint64_t st_size
Definition: uv.h:354
uv_tty_mode_t
uv_tty_mode_t
Definition: uv.h:710
uv_read_cb
void(* uv_read_cb)(uv_stream_t *stream, ssize_t nread, const uv_buf_t *buf)
Definition: uv.h:309
uv_rusage_t::ru_nivcsw
uint64_t ru_nivcsw
Definition: uv.h:1178
alloc_cb
static void alloc_cb(uv_handle_t *handle, size_t suggested_size, uv_buf_t *buf)
Definition: benchmark-pound.c:84
UV_FS_LCHOWN
@ UV_FS_LCHOWN
Definition: uv.h:1277
uv_rusage_t::ru_majflt
uint64_t ru_majflt
Definition: uv.h:1170
uv_udp_set_membership
UV_EXTERN int uv_udp_set_membership(uv_udp_t *handle, const char *multicast_addr, const char *interface_addr, uv_membership membership)
Definition: unix/udp.c:1019
file
Definition: bloaty/third_party/zlib/examples/gzappend.c:170
send_cb
static void send_cb(uv_udp_send_t *req, int status)
Definition: benchmark-udp-pummel.c:72
uv_err_name_r
UV_EXTERN char * uv_err_name_r(int err, char *buf, size_t buflen)
Definition: uv-common.c:178
uv_stat_t::st_gen
uint64_t st_gen
Definition: uv.h:358
UV_FS_EVENT_WATCH_ENTRY
@ UV_FS_EVENT_WATCH_ENTRY
Definition: uv.h:1591
UV_GETADDRINFO_PRIVATE_FIELDS
#define UV_GETADDRINFO_PRIVATE_FIELDS
Definition: unix.h:337
UV_PIPE_PRIVATE_FIELDS
#define UV_PIPE_PRIVATE_FIELDS
Definition: unix.h:307
uv_fs_get_path
const UV_EXTERN char * uv_fs_get_path(const uv_fs_t *)
Definition: uv-data-getter-setters.c:84
uv_process_options_s::uid
uv_uid_t uid
Definition: uv.h:981
status
absl::Status status
Definition: rls.cc:251
uv_walk_cb
void(* uv_walk_cb)(uv_handle_t *handle, void *arg)
Definition: uv.h:324
uv_statfs_s::f_ffree
uint64_t f_ffree
Definition: uv.h:1124
uv_uid_t
uid_t uv_uid_t
Definition: unix.h:167
uv_fs_s::path
const char * path
Definition: uv.h:1301
uv_getnameinfo_s
Definition: uv.h:894
mode
const char int mode
Definition: bloaty/third_party/zlib/contrib/minizip/ioapi.h:135
setup.name
name
Definition: setup.py:542
uv_dlopen
UV_EXTERN int uv_dlopen(const char *filename, uv_lib_t *lib)
Definition: unix/dl.c:33
uv_fs_cb
void(* uv_fs_cb)(uv_fs_t *req)
Definition: uv.h:325
uv_signal_start_oneshot
UV_EXTERN int uv_signal_start_oneshot(uv_signal_t *handle, uv_signal_cb signal_cb, int signum)
Definition: unix/signal.c:343
uv_get_total_memory
UV_EXTERN uint64_t uv_get_total_memory(void)
Definition: aix.c:337
uv_strerror
const UV_EXTERN char * uv_strerror(int err)
Definition: uv-common.c:212
uv_loop_get_data
UV_EXTERN void * uv_loop_get_data(const uv_loop_t *)
Definition: uv-data-getter-setters.c:92
uv_thread_join
UV_EXTERN int uv_thread_join(uv_thread_t *tid)
Definition: libuv/src/unix/thread.c:271
version
Definition: version.py:1
uv_thread_self
UV_EXTERN uv_thread_t uv_thread_self(void)
Definition: libuv/src/unix/thread.c:267
UV_FS_EVENT_PRIVATE_FIELDS
#define UV_FS_EVENT_PRIVATE_FIELDS
Definition: unix.h:393
check_documentation.path
path
Definition: check_documentation.py:57
uv_random_s::buflen
size_t buflen
Definition: uv.h:1638
uv_udp_getsockname
UV_EXTERN int uv_udp_getsockname(const uv_udp_t *handle, struct sockaddr *name, int *namelen)
Definition: unix/udp.c:1293
UV_FS_FTRUNCATE
@ UV_FS_FTRUNCATE
Definition: uv.h:1256
uv_thread_equal
UV_EXTERN int uv_thread_equal(const uv_thread_t *t1, const uv_thread_t *t2)
Definition: libuv/src/unix/thread.c:276
uv_fs_poll_stop
UV_EXTERN int uv_fs_poll_stop(uv_fs_poll_t *handle)
Definition: fs-poll.c:116
uv_udp_connect
UV_EXTERN int uv_udp_connect(uv_udp_t *handle, const struct sockaddr *addr)
Definition: uv-common.c:335
uv_getnameinfo_s::loop
UV_REQ_FIELDS uv_loop_t * loop
Definition: uv.h:897
uv_env_item_s::name
char * name
Definition: uv.h:1219
uv_timer_stop
UV_EXTERN int uv_timer_stop(uv_timer_t *handle)
Definition: timer.c:97
uv_run
UV_EXTERN int uv_run(uv_loop_t *, uv_run_mode mode)
Definition: unix/core.c:361
uv_loop_s::stop_flag
unsigned int stop_flag
Definition: uv.h:1778
UV_FS_READLINK
@ UV_FS_READLINK
Definition: uv.h:1272
uv_udp_send_s::cb
uv_udp_send_cb cb
Definition: uv.h:648
UV_FS_UNLINK
@ UV_FS_UNLINK
Definition: uv.h:1264
uv_fs_event_stop
UV_EXTERN int uv_fs_event_stop(uv_fs_event_t *handle)
Definition: aix.c:798
uv_key_delete
UV_EXTERN void uv_key_delete(uv_key_t *key)
Definition: libuv/src/unix/thread.c:838
uv_queue_work
UV_EXTERN int uv_queue_work(uv_loop_t *loop, uv_work_t *req, uv_work_cb work_cb, uv_after_work_cb after_work_cb)
Definition: threadpool.c:338
uv_os_gethostname
UV_EXTERN int uv_os_gethostname(char *buffer, size_t *size)
Definition: unix/core.c:1354
uv_tcp_getsockname
UV_EXTERN int uv_tcp_getsockname(const uv_tcp_t *handle, struct sockaddr *name, int *namelen)
Definition: unix/tcp.c:283
uv_interface_addresses
UV_EXTERN int uv_interface_addresses(uv_interface_address_t **addresses, int *count)
Definition: aix.c:1042
uv_fs_s::result
ssize_t result
Definition: uv.h:1299
uv_fs_s
Definition: uv.h:1294
uv_is_closing
UV_EXTERN int uv_is_closing(const uv_handle_t *handle)
Definition: unix/core.c:319
uv_stat_t::st_blksize
uint64_t st_blksize
Definition: uv.h:355
uv_req_get_data
UV_EXTERN void * uv_req_get_data(const uv_req_t *req)
Definition: uv-data-getter-setters.c:48
UV_PRIVATE_REQ_TYPES
#define UV_PRIVATE_REQ_TYPES
Definition: unix.h:258
uv_poll_cb
void(* uv_poll_cb)(uv_poll_t *handle, int status, int events)
Definition: uv.h:317
uv_cond_wait
UV_EXTERN void uv_cond_wait(uv_cond_t *cond, uv_mutex_t *mutex)
Definition: libuv/src/unix/thread.c:780
uv_fs_mkdir
UV_EXTERN int uv_fs_mkdir(uv_loop_t *loop, uv_fs_t *req, const char *path, int mode, uv_fs_cb cb)
Definition: unix/fs.c:1776
uv_check_cb
void(* uv_check_cb)(uv_check_t *handle)
Definition: uv.h:321
UV_FS_EVENT_STAT
@ UV_FS_EVENT_STAT
Definition: uv.h:1600
uv_stat_t::st_gid
uint64_t st_gid
Definition: uv.h:351
uv_thread_options_s
Definition: uv.h:1739
UV_HANDLE_TYPE_MAP
#define UV_HANDLE_TYPE_MAP(XX)
Definition: uv.h:152
uv_poll_start
UV_EXTERN int uv_poll_start(uv_poll_t *handle, int events, uv_poll_cb cb)
Definition: unix/poll.c:118
uv_unref
UV_EXTERN void uv_unref(uv_handle_t *)
Definition: uv-common.c:522
uv_tcp_bind
UV_EXTERN int uv_tcp_bind(uv_tcp_t *handle, const struct sockaddr *addr, unsigned int flags)
Definition: uv-common.c:277
uv_cpu_info_s::cpu_times
struct uv_cpu_times_s cpu_times
Definition: uv.h:1082
UV_FS_FUTIME
@ UV_FS_FUTIME
Definition: uv.h:1258
uv_fs_futime
UV_EXTERN int uv_fs_futime(uv_loop_t *loop, uv_fs_t *req, uv_file file, double atime, double mtime, uv_fs_cb cb)
Definition: unix/fs.c:1731
uv_interface_address_s::netmask
union uv_interface_address_s::@401 netmask
UV_TIMER_PRIVATE_FIELDS
#define UV_TIMER_PRIVATE_FIELDS
Definition: unix.h:330
uv_close
UV_EXTERN void uv_close(uv_handle_t *handle, uv_close_cb close_cb)
Definition: unix/core.c:112
uv_connect_s::cb
UV_REQ_FIELDS uv_connect_cb cb
Definition: uv.h:582
uv_alloc_cb
void(* uv_alloc_cb)(uv_handle_t *handle, size_t suggested_size, uv_buf_t *buf)
Definition: uv.h:306
uv_random_s
Definition: uv.h:1631
uv_timeval_t::tv_sec
long tv_sec
Definition: uv.h:1153
uv_stream_s
Definition: uv.h:491
uv_cond_t
Definition: win.h:249
uv_getaddrinfo_cb
void(* uv_getaddrinfo_cb)(uv_getaddrinfo_t *req, int status, struct addrinfo *res)
Definition: uv.h:328
tid
int tid
Definition: fake_binder_test.cc:236
uv_os_sock_t
int uv_os_sock_t
Definition: unix.h:127
UV_STREAM_FIELDS
#define UV_STREAM_FIELDS
Definition: uv.h:476
uv_rwlock_destroy
UV_EXTERN void uv_rwlock_destroy(uv_rwlock_t *rwlock)
Definition: libuv/src/unix/thread.c:360
uv_interface_address_s::name
char * name
Definition: uv.h:1086
uv_free_func
void(* uv_free_func)(void *ptr)
Definition: uv.h:266
UV_TTY_MODE_IO
@ UV_TTY_MODE_IO
Definition: uv.h:716
uv_os_uname
UV_EXTERN int uv_os_uname(uv_utsname_t *buffer)
Definition: unix/core.c:1430
uv_tcp_connect
UV_EXTERN int uv_tcp_connect(uv_connect_t *req, uv_tcp_t *handle, const struct sockaddr *addr, uv_connect_cb cb)
Definition: uv-common.c:315
uv_os_getpriority
UV_EXTERN int uv_os_getpriority(uv_pid_t pid, int *priority)
Definition: unix/core.c:1402
uv_fs_statfs
UV_EXTERN int uv_fs_statfs(uv_loop_t *loop, uv_fs_t *req, const char *path, uv_fs_cb cb)
Definition: unix/fs.c:2077
uv_tcp_open
UV_EXTERN int uv_tcp_open(uv_tcp_t *handle, uv_os_sock_t sock)
Definition: unix/tcp.c:267
uv_ip4_addr
UV_EXTERN int uv_ip4_addr(const char *ip, int port, struct sockaddr_in *addr)
Definition: uv-common.c:221
uv_fs_unlink
UV_EXTERN int uv_fs_unlink(uv_loop_t *loop, uv_fs_t *req, const char *path, uv_fs_cb cb)
Definition: unix/fs.c:1974
uv_idle_stop
UV_EXTERN int uv_idle_stop(uv_idle_t *idle)
uv_fs_event_getpath
UV_EXTERN int uv_fs_event_getpath(uv_fs_event_t *handle, char *buffer, size_t *size)
Definition: uv-common.c:562
uv_process_options_s::file
const char * file
Definition: uv.h:942
UV_WRITE_PRIVATE_FIELDS
#define UV_WRITE_PRIVATE_FIELDS
Definition: unix.h:260
uv_getnameinfo
UV_EXTERN int uv_getnameinfo(uv_loop_t *loop, uv_getnameinfo_t *req, uv_getnameinfo_cb getnameinfo_cb, const struct sockaddr *addr, int flags)
Definition: unix/getnameinfo.c:81
UV_WRITABLE_PIPE
@ UV_WRITABLE_PIPE
Definition: uv.h:922
uv_print_all_handles
UV_EXTERN void uv_print_all_handles(uv_loop_t *loop, FILE *stream)
Definition: uv-common.c:507
uv_req_set_data
UV_EXTERN void uv_req_set_data(uv_req_t *req, void *data)
Definition: uv-data-getter-setters.c:52
UV_IDLE_PRIVATE_FIELDS
#define UV_IDLE_PRIVATE_FIELDS
Definition: unix.h:321
uv_rusage_t::ru_isrss
uint64_t ru_isrss
Definition: uv.h:1168
uv_random_s::buf
void * buf
Definition: uv.h:1637
uv_walk
UV_EXTERN void uv_walk(uv_loop_t *loop, uv_walk_cb walk_cb, void *arg)
Definition: uv-common.c:456
uv_loop_close
UV_EXTERN int uv_loop_close(uv_loop_t *loop)
Definition: uv-common.c:761
UV_FS_STAT
@ UV_FS_STAT
Definition: uv.h:1253
uv_tcp_getpeername
UV_EXTERN int uv_tcp_getpeername(const uv_tcp_t *handle, struct sockaddr *name, int *namelen)
Definition: unix/tcp.c:297
server
std::unique_ptr< Server > server
Definition: channelz_service_test.cc:330
uv_cpu_times_s::nice
uint64_t nice
Definition: uv.h:1073
uv_update_time
UV_EXTERN void uv_update_time(uv_loop_t *)
Definition: unix/core.c:413
uv_key_get
UV_EXTERN void * uv_key_get(uv_key_t *key)
Definition: libuv/src/unix/thread.c:844
uv_rusage_t::ru_nsignals
uint64_t ru_nsignals
Definition: uv.h:1176
uv_udp_init
UV_EXTERN int uv_udp_init(uv_loop_t *, uv_udp_t *handle)
Definition: unix/udp.c:988
uv_default_loop
UV_EXTERN uv_loop_t * uv_default_loop(void)
Definition: uv-common.c:733
uv_async_s
Definition: uv.h:834
uv_check_s
Definition: uv.h:814
uv_stdio_flags
uv_stdio_flags
Definition: uv.h:910
uv_rusage_t::ru_oublock
uint64_t ru_oublock
Definition: uv.h:1173
uv_any_req
Definition: uv.h:1761
uv_uptime
UV_EXTERN int uv_uptime(double *uptime)
Definition: aix.c:959
uv_fs_mkstemp
UV_EXTERN int uv_fs_mkstemp(uv_loop_t *loop, uv_fs_t *req, const char *tpl, uv_fs_cb cb)
Definition: unix/fs.c:1800
uv_req_get_type
UV_EXTERN uv_req_type uv_req_get_type(const uv_req_t *req)
Definition: uv-data-getter-setters.c:44
uv_thread_options_s::stack_size
size_t stack_size
Definition: uv.h:1741
UV_FS_CHMOD
@ UV_FS_CHMOD
Definition: uv.h:1260
uv_key_t
Definition: win.h:284
ssize_t
intptr_t ssize_t
Definition: win.h:27
uv_fs_s::cb
uv_fs_cb cb
Definition: uv.h:1298
uv_lib_t
Definition: unix.h:216
uv_stdio_container_s::flags
uv_stdio_flags flags
Definition: uv.h:932
uv_process_options_s::stdio
uv_stdio_container_t * stdio
Definition: uv.h:975
UV_TTY_SUPPORTED
@ UV_TTY_SUPPORTED
Definition: uv.h:724
uv_random_cb
void(* uv_random_cb)(uv_random_t *req, int status, void *buf, size_t buflen)
Definition: uv.h:335
sockaddr_in6
Definition: ares_ipv6.h:25
uv_loop_fork
UV_EXTERN int uv_loop_fork(uv_loop_t *loop)
Definition: loop.c:113
uv_loop_s::count
unsigned int count
Definition: uv.h:1775
uv_timespec_t::tv_nsec
long tv_nsec
Definition: uv.h:342
uv_fs_mkdtemp
UV_EXTERN int uv_fs_mkdtemp(uv_loop_t *loop, uv_fs_t *req, const char *tpl, uv_fs_cb cb)
Definition: unix/fs.c:1788
int64_t
signed __int64 int64_t
Definition: stdint-msvc2008.h:89
uv_process_options_s::args
char ** args
Definition: uv.h:949
UV_FS_PRIVATE_FIELDS
#define UV_FS_PRIVATE_FIELDS
Definition: unix.h:359
UV_UDP_RECVMMSG
@ UV_UDP_RECVMMSG
Definition: uv.h:618
uv_fs_get_statbuf
UV_EXTERN uv_stat_t * uv_fs_get_statbuf(uv_fs_t *)
Definition: uv-data-getter-setters.c:88
uv_stat_t::st_ino
uint64_t st_ino
Definition: uv.h:353
uv_work_s::after_work_cb
uv_after_work_cb after_work_cb
Definition: uv.h:1059
uv_getaddrinfo_s::loop
UV_REQ_FIELDS uv_loop_t * loop
Definition: uv.h:874
uv_write
UV_EXTERN int uv_write(uv_write_t *req, uv_stream_t *handle, const uv_buf_t bufs[], unsigned int nbufs, uv_write_cb cb)
Definition: unix/stream.c:1492
uv_is_readable
UV_EXTERN int uv_is_readable(const uv_stream_t *handle)
Definition: unix/stream.c:1606
uv_req_type_name
const UV_EXTERN char * uv_req_type_name(uv_req_type type)
Definition: uv-data-getter-setters.c:31
uv_udp_set_multicast_loop
UV_EXTERN int uv_udp_set_multicast_loop(uv_udp_t *handle, int on)
Definition: unix/udp.c:1210
uv_once
UV_EXTERN void uv_once(uv_once_t *guard, void(*callback)(void))
Definition: libuv/src/unix/thread.c:418
uv_barrier_init
UV_EXTERN int uv_barrier_init(uv_barrier_t *barrier, unsigned int count)
Definition: libuv/src/unix/thread.c:55
uv_free_interface_addresses
UV_EXTERN void uv_free_interface_addresses(uv_interface_address_t *addresses, int count)
Definition: aix.c:1210
uv_stream_get_write_queue_size
UV_EXTERN size_t uv_stream_get_write_queue_size(const uv_stream_t *stream)
Definition: uv-data-getter-setters.c:56
uv_random_s::status
int status
Definition: uv.h:1636
uv_passwd_s::shell
char * shell
Definition: uv.h:1103
uv_dir_s::reserved
void * reserved[4]
Definition: uv.h:1289
UV_FILE
@ UV_FILE
Definition: uv.h:194
req
static uv_connect_t req
Definition: test-connection-fail.c:30
uv_cond_destroy
UV_EXTERN void uv_cond_destroy(uv_cond_t *cond)
Definition: libuv/src/unix/thread.c:736
uv_rusage_t::ru_msgsnd
uint64_t ru_msgsnd
Definition: uv.h:1174
uv_translate_sys_error
UV_EXTERN int uv_translate_sys_error(int sys_errno)
Definition: unix/core.c:1244
uv_env_item_s
Definition: uv.h:1218
work_cb
static void work_cb(uv_work_t *req)
Definition: test-fork.c:610
UV_FS_READDIR
@ UV_FS_READDIR
Definition: uv.h:1279
UV_RUN_DEFAULT
@ UV_RUN_DEFAULT
Definition: uv.h:254
getnameinfo_cb
static void getnameinfo_cb(uv_getnameinfo_t *handle, int status, const char *hostname, const char *service)
Definition: test-threadpool-cancel.c:106
uv_dlclose
UV_EXTERN void uv_dlclose(uv_lib_t *lib)
Definition: unix/dl.c:41
uv_version_string
const UV_EXTERN char * uv_version_string(void)
Definition: version.c:43
UV_UDP_MMSG_CHUNK
@ UV_UDP_MMSG_CHUNK
Definition: uv.h:613
uv_process_options_s::stdio_count
int stdio_count
Definition: uv.h:974
uv_thread_create_ex
UV_EXTERN int uv_thread_create_ex(uv_thread_t *tid, const uv_thread_options_t *params, uv_thread_cb entry, void *arg)
Definition: libuv/src/unix/thread.c:215
uv_write_s::handle
uv_stream_t * handle
Definition: uv.h:526
uv_process_options_s::flags
unsigned int flags
Definition: uv.h:964
uv_udp_s
Definition: uv.h:629
uv_tcp_close_reset
UV_EXTERN int uv_tcp_close_reset(uv_tcp_t *handle, uv_close_cb close_cb)
Definition: unix/tcp.c:311
UV_ASYNC_PRIVATE_FIELDS
#define UV_ASYNC_PRIVATE_FIELDS
Definition: unix.h:325
uv_cpu_times_s
Definition: uv.h:1071
UV_CHECK_PRIVATE_FIELDS
#define UV_CHECK_PRIVATE_FIELDS
Definition: unix.h:317
uv_backend_fd
UV_EXTERN int uv_backend_fd(const uv_loop_t *)
Definition: unix/core.c:324
uv_stat_t::st_mode
uint64_t st_mode
Definition: uv.h:348
cond
static uv_cond_t cond
Definition: threadpool.c:33
uv_shutdown
UV_PRIVATE_REQ_TYPES UV_EXTERN int uv_shutdown(uv_shutdown_t *req, uv_stream_t *handle, uv_shutdown_cb cb)
Definition: unix/stream.c:1259
UV_INHERIT_FD
@ UV_INHERIT_FD
Definition: uv.h:913
signal_cb
static void signal_cb(uv_signal_t *signal, int signum)
Definition: test-signal-pending-on-close.c:42
UV_HANDLE_FIELDS
#define UV_HANDLE_FIELDS
Definition: uv.h:425
uv_cwd
UV_EXTERN int uv_cwd(char *buffer, size_t *size)
Definition: unix/core.c:696
uint64_t
unsigned __int64 uint64_t
Definition: stdint-msvc2008.h:90
UV_INHERIT_STREAM
@ UV_INHERIT_STREAM
Definition: uv.h:914
uv_dirent_s::name
const char * name
Definition: uv.h:1140
uv_stat_t::st_ctim
uv_timespec_t st_ctim
Definition: uv.h:361
uv_is_active
UV_EXTERN int uv_is_active(const uv_handle_t *handle)
Definition: unix/core.c:418
uv_getnameinfo_cb
void(* uv_getnameinfo_cb)(uv_getnameinfo_t *req, int status, const char *hostname, const char *service)
Definition: uv.h:331
UV_DIRENT_SOCKET
@ UV_DIRENT_SOCKET
Definition: uv.h:1134
uv_udp_getpeername
UV_EXTERN int uv_udp_getpeername(const uv_udp_t *handle, struct sockaddr *name, int *namelen)
Definition: unix/udp.c:1283
uv_setup_args
UV_EXTERN char ** uv_setup_args(int argc, char **argv)
Definition: aix.c:832
uv_random_s::cb
uv_random_cb cb
Definition: uv.h:1639
uv_stat_t::st_atim
uv_timespec_t st_atim
Definition: uv.h:359
uv_read_start
UV_EXTERN int uv_read_start(uv_stream_t *, uv_alloc_cb alloc_cb, uv_read_cb read_cb)
Definition: unix/stream.c:1555
uv_rwlock_wrlock
UV_EXTERN void uv_rwlock_wrlock(uv_rwlock_t *rwlock)
Definition: libuv/src/unix/thread.c:392
uv_loop_option
uv_loop_option
Definition: uv.h:249
uv_fs_fsync
UV_EXTERN int uv_fs_fsync(uv_loop_t *loop, uv_fs_t *req, uv_file file, uv_fs_cb cb)
Definition: unix/fs.c:1712
uv_os_environ
UV_EXTERN int uv_os_environ(uv_env_item_t **envitems, int *count)
Definition: unix/core.c:1250
UV_DIRENT_CHAR
@ UV_DIRENT_CHAR
Definition: uv.h:1135
uv_rwlock_wrunlock
UV_EXTERN void uv_rwlock_wrunlock(uv_rwlock_t *rwlock)
Definition: libuv/src/unix/thread.c:412
uv_prepare_start
UV_EXTERN int uv_prepare_start(uv_prepare_t *prepare, uv_prepare_cb cb)
arg
Definition: cmdline.cc:40
uv_fs_event_s::path
UV_HANDLE_FIELDS char * path
Definition: uv.h:1536
uv_fs_poll_s::poll_ctx
UV_HANDLE_FIELDS void * poll_ctx
Definition: uv.h:1547
uv_fs_fchmod
UV_EXTERN int uv_fs_fchmod(uv_loop_t *loop, uv_fs_t *req, uv_file file, int mode, uv_fs_cb cb)
Definition: unix/fs.c:1658
uv_try_write
UV_EXTERN int uv_try_write(uv_stream_t *handle, const uv_buf_t bufs[], unsigned int nbufs)
Definition: unix/stream.c:1507
uv_dirent_s::type
uv_dirent_type_t type
Definition: uv.h:1141
UV_RENAME
@ UV_RENAME
Definition: uv.h:1528
uv_thread_options_s::flags
unsigned int flags
Definition: uv.h:1740
uv_shutdown_cb
void(* uv_shutdown_cb)(uv_shutdown_t *req, int status)
Definition: uv.h:314
uv_backend_timeout
UV_EXTERN int uv_backend_timeout(const uv_loop_t *)
Definition: unix/core.c:329
uv_once_t
pthread_once_t uv_once_t
Definition: unix.h:133
uv_dir_s::nentries
size_t nentries
Definition: uv.h:1288
uv_udp_send_cb
void(* uv_udp_send_cb)(uv_udp_send_t *req, int status)
Definition: uv.h:621
UV_FS_LINK
@ UV_FS_LINK
Definition: uv.h:1270
uv_thread_create_flags
uv_thread_create_flags
Definition: uv.h:1734
uv_if_indextoiid
UV_EXTERN int uv_if_indextoiid(unsigned int ifindex, char *buffer, size_t *size)
Definition: unix/getaddrinfo.c:253
uv_udp_get_send_queue_size
UV_EXTERN size_t uv_udp_get_send_queue_size(const uv_udp_t *handle)
Definition: uv-data-getter-setters.c:60
uv_process_s::pid
int pid
Definition: uv.h:1040
uv_check_stop
UV_EXTERN int uv_check_stop(uv_check_t *check)
uv_fs_event
uv_fs_event
Definition: uv.h:1527
uv_mutex_t
pthread_mutex_t uv_mutex_t
Definition: unix.h:135
uv_shutdown_s::handle
UV_REQ_FIELDS uv_stream_t * handle
Definition: uv.h:419
uv_set_process_title
UV_EXTERN int uv_set_process_title(const char *title)
Definition: aix.c:875
uv_tcp_init
UV_EXTERN int uv_tcp_init(uv_loop_t *, uv_tcp_t *handle)
Definition: unix/tcp.c:143
uv_fs_fdatasync
UV_EXTERN int uv_fs_fdatasync(uv_loop_t *loop, uv_fs_t *req, uv_file file, uv_fs_cb cb)
Definition: unix/fs.c:1698
gen_synthetic_protos.base
base
Definition: gen_synthetic_protos.py:31
uv_exit_cb
void(* uv_exit_cb)(uv_process_t *, int64_t exit_status, int term_signal)
Definition: uv.h:323
UV_TCP_IPV6ONLY
@ UV_TCP_IPV6ONLY
Definition: uv.h:561
uv_membership
uv_membership
Definition: uv.h:379
uv_fs_s::loop
uv_loop_t * loop
Definition: uv.h:1297
data
char data[kBufferLength]
Definition: abseil-cpp/absl/strings/internal/str_format/float_conversion.cc:1006
callback
static void callback(void *arg, int status, int timeouts, struct hostent *host)
Definition: acountry.c:224
uv_accept
UV_EXTERN int uv_accept(uv_stream_t *server, uv_stream_t *client)
Definition: unix/stream.c:591
uv_cond_timedwait
UV_EXTERN int uv_cond_timedwait(uv_cond_t *cond, uv_mutex_t *mutex, uint64_t timeout)
Definition: libuv/src/unix/thread.c:786
uv_loop_init
UV_EXTERN int uv_loop_init(uv_loop_t *loop)
Definition: loop.c:30
prepare
static uv_prepare_t prepare
Definition: test-async.c:30
uv_thread_create
UV_EXTERN int uv_thread_create(uv_thread_t *tid, uv_thread_cb entry, void *arg)
Definition: libuv/src/unix/thread.c:209
uv_random_s::work_req
struct uv__work work_req
Definition: uv.h:1640
buffer
char buffer[1024]
Definition: libuv/docs/code/idle-compute/main.c:8
uv_version
UV_EXTERN unsigned int uv_version(void)
Definition: version.c:38
UV_READABLE
@ UV_READABLE
Definition: uv.h:790
uv_fs_poll_start
UV_EXTERN int uv_fs_poll_start(uv_fs_poll_t *handle, uv_fs_poll_cb poll_cb, const char *path, unsigned int interval)
Definition: fs-poll.c:66
uv_sleep
UV_EXTERN void uv_sleep(unsigned int msec)
Definition: unix/core.c:1521
uv_loop_alive
UV_EXTERN int uv_loop_alive(const uv_loop_t *loop)
Definition: unix/core.c:356
recv_cb
static void recv_cb(uv_udp_t *handle, ssize_t nread, const uv_buf_t *buf, const struct sockaddr *addr, unsigned flags)
Definition: benchmark-udp-pummel.c:109
uv_stdio_container_s
Definition: uv.h:931
uv_file
int uv_file
Definition: unix.h:126
uv_udp_recv_cb
void(* uv_udp_recv_cb)(uv_udp_t *handle, ssize_t nread, const uv_buf_t *buf, const struct sockaddr *addr, unsigned flags)
Definition: uv.h:622
uv_mutex_unlock
UV_EXTERN void uv_mutex_unlock(uv_mutex_t *handle)
Definition: libuv/src/unix/thread.c:349
uv_sem_t
UV_PLATFORM_SEM_T uv_sem_t
Definition: unix.h:137
uv_after_work_cb
void(* uv_after_work_cb)(uv_work_t *req, int status)
Definition: uv.h:327
uv_timer_s
Definition: uv.h:850
uv_stdio_container_s::fd
int fd
Definition: uv.h:936
uv_signal_stop
UV_EXTERN int uv_signal_stop(uv_signal_t *handle)
Definition: unix/signal.c:511
close_cb
static void close_cb(uv_handle_t *handle)
Definition: benchmark-million-timers.c:36
poll_cb
static void poll_cb(uv_fs_t *req)
Definition: fs-poll.c:185
uv_write_s::cb
UV_REQ_FIELDS uv_write_cb cb
Definition: uv.h:524
UV_ERRNO_MAP
#define UV_ERRNO_MAP(XX)
Definition: uv.h:70
uv_cpu_times_s::user
uint64_t user
Definition: uv.h:1072
uv_fs_close
UV_EXTERN int uv_fs_close(uv_loop_t *loop, uv_fs_t *req, uv_file file, uv_fs_cb cb)
Definition: unix/fs.c:1651
uv_pipe_getsockname
UV_EXTERN int uv_pipe_getsockname(const uv_pipe_t *handle, char *buffer, size_t *size)
Definition: unix/pipe.c:284
uv_fs_get_ptr
UV_EXTERN void * uv_fs_get_ptr(const uv_fs_t *)
Definition: uv-data-getter-setters.c:80
UV_FS_CLOSEDIR
@ UV_FS_CLOSEDIR
Definition: uv.h:1280
uv_ip4_name
UV_EXTERN int uv_ip4_name(const struct sockaddr_in *src, char *dst, size_t size)
Definition: uv-common.c:267
uv_timeval64_t::tv_usec
int32_t tv_usec
Definition: uv.h:1159
uv_print_active_handles
UV_EXTERN void uv_print_active_handles(uv_loop_t *loop, FILE *stream)
Definition: uv-common.c:512
uv_rusage_t::ru_nvcsw
uint64_t ru_nvcsw
Definition: uv.h:1177
uv_stat_t::st_uid
uint64_t st_uid
Definition: uv.h:350
uv_rusage_t::ru_ixrss
uint64_t ru_ixrss
Definition: uv.h:1166
uv_tcp_s
Definition: uv.h:544
uv_get_osfhandle
UV_EXTERN uv_os_fd_t uv_get_osfhandle(int fd)
Definition: unix/core.c:1384
stdint.h
uv_rusage_t::ru_minflt
uint64_t ru_minflt
Definition: uv.h:1169
uv_cpu_info_s::model
char * model
Definition: uv.h:1080
uv_stat_t::st_birthtim
uv_timespec_t st_birthtim
Definition: uv.h:362
UV_CHANGE
@ UV_CHANGE
Definition: uv.h:1529
uv_connect_cb
void(* uv_connect_cb)(uv_connect_t *req, int status)
Definition: uv.h:313
uv_sem_post
UV_EXTERN void uv_sem_post(uv_sem_t *sem)
Definition: libuv/src/unix/thread.c:669
uv_stream_set_blocking
UV_EXTERN int uv_stream_set_blocking(uv_stream_t *handle, int blocking)
Definition: unix/stream.c:1688
uv_spawn
UV_EXTERN int uv_spawn(uv_loop_t *loop, uv_process_t *handle, const uv_process_options_t *options)
Definition: unix/process.c:408
UV_FS_LSTAT
@ UV_FS_LSTAT
Definition: uv.h:1254
uv_fs_scandir
UV_EXTERN int uv_fs_scandir(uv_loop_t *loop, uv_fs_t *req, const char *path, int flags, uv_fs_cb cb)
Definition: unix/fs.c:1854
uv_handle_get_loop
UV_EXTERN uv_loop_t * uv_handle_get_loop(const uv_handle_t *handle)
Definition: uv-data-getter-setters.c:23
uv_exepath
UV_EXTERN int uv_exepath(char *buffer, size_t *size)
Definition: aix-common.c:79
uv_freeaddrinfo
UV_EXTERN void uv_freeaddrinfo(struct addrinfo *ai)
Definition: unix/getaddrinfo.c:223
uv_cond_broadcast
UV_EXTERN void uv_cond_broadcast(uv_cond_t *cond)
Definition: libuv/src/unix/thread.c:775
uv_fs_utime
UV_EXTERN int uv_fs_utime(uv_loop_t *loop, uv_fs_t *req, const char *path, double atime, double mtime, uv_fs_cb cb)
Definition: unix/fs.c:1981
uv_sem_init
UV_EXTERN int uv_sem_init(uv_sem_t *sem, unsigned int value)
Definition: libuv/src/unix/thread.c:649
uv_process_options_s::env
char ** env
Definition: uv.h:954
uv_idle_init
UV_EXTERN int uv_idle_init(uv_loop_t *, uv_idle_t *idle)
uv_fs_get_type
UV_EXTERN uv_fs_type uv_fs_get_type(const uv_fs_t *)
Definition: uv-data-getter-setters.c:72
UV_JOIN_GROUP
@ UV_JOIN_GROUP
Definition: uv.h:381
uv_work_cb
void(* uv_work_cb)(uv_work_t *req)
Definition: uv.h:326
uv_utsname_s::release
char release[256]
Definition: uv.h:1109
uv_recv_buffer_size
UV_EXTERN int uv_recv_buffer_size(uv_handle_t *handle, int *value)
Definition: uv-common.c:554
uv_udp_send_s
Definition: uv.h:645
uv_timer_set_repeat
UV_EXTERN void uv_timer_set_repeat(uv_timer_t *handle, uint64_t repeat)
Definition: timer.c:123
tests.unit._exit_scenarios.port
port
Definition: _exit_scenarios.py:179
uv_chdir
UV_EXTERN int uv_chdir(const char *dir)
Definition: unix/core.c:735
uv_stdio_container_s::stream
uv_stream_t * stream
Definition: uv.h:935
uv_utsname_s::machine
char machine[256]
Definition: uv.h:1111
uv_fs_chmod
UV_EXTERN int uv_fs_chmod(uv_loop_t *loop, uv_fs_t *req, const char *path, int mode, uv_fs_cb cb)
Definition: unix/fs.c:1625
uv_interface_address_s
Definition: uv.h:1085
uv_run_mode
uv_run_mode
Definition: uv.h:253
uv_fs_read
UV_EXTERN int uv_fs_read(uv_loop_t *loop, uv_fs_t *req, uv_file file, const uv_buf_t bufs[], unsigned int nbufs, int64_t offset, uv_fs_cb cb)
Definition: unix/fs.c:1826
bufs
static uv_buf_t bufs[5]
Definition: benchmark-udp-pummel.c:51
value
const char * value
Definition: hpack_parser_table.cc:165
uv_fs_event_flags
uv_fs_event_flags
Definition: uv.h:1583
uv_rusage_t::ru_msgrcv
uint64_t ru_msgrcv
Definition: uv.h:1175
UV_DIRENT_FIFO
@ UV_DIRENT_FIFO
Definition: uv.h:1133
uv_udp_recv_start
UV_EXTERN int uv_udp_recv_start(uv_udp_t *handle, uv_alloc_cb alloc_cb, uv_udp_recv_cb recv_cb)
Definition: uv-common.c:438
uv_passwd_s::uid
long uid
Definition: uv.h:1101
uv_req_size
UV_EXTERN size_t uv_req_size(uv_req_type type)
Definition: uv-common.c:141
uv_stat_t::st_nlink
uint64_t st_nlink
Definition: uv.h:349
uv_timeval64_t
Definition: uv.h:1157
uv_udp_set_multicast_interface
UV_EXTERN int uv_udp_set_multicast_interface(uv_udp_t *handle, const char *interface_addr)
Definition: unix/udp.c:1234
uv_loop_s::data
void * data
Definition: uv.h:1769
uv_statfs_s
Definition: uv.h:1117
uv_dirent_s
Definition: uv.h:1139
uv_get_constrained_memory
UV_EXTERN uint64_t uv_get_constrained_memory(void)
Definition: aix.c:347
UV_PROCESS_WINDOWS_HIDE
@ UV_PROCESS_WINDOWS_HIDE
Definition: uv.h:1019
uv_tcp_init_ex
UV_EXTERN int uv_tcp_init_ex(uv_loop_t *, uv_tcp_t *handle, unsigned int flags)
Definition: unix/tcp.c:114
uv_barrier_t
Definition: unix.h:154
uv_fs_ftruncate
UV_EXTERN int uv_fs_ftruncate(uv_loop_t *loop, uv_fs_t *req, uv_file file, int64_t offset, uv_fs_cb cb)
Definition: unix/fs.c:1719
async_cb
static void async_cb(uv_async_t *handle)
Definition: benchmark-async-pummel.c:39
UV_FS_FCHMOD
@ UV_FS_FCHMOD
Definition: uv.h:1261
uv_rwlock_init
UV_EXTERN int uv_rwlock_init(uv_rwlock_t *rwlock)
Definition: libuv/src/unix/thread.c:355
uv_fs_type
uv_fs_type
Definition: uv.h:1245
uv_fs_poll_cb
void(* uv_fs_poll_cb)(uv_fs_poll_t *handle, int status, const uv_stat_t *prev, const uv_stat_t *curr)
Definition: uv.h:371
uv_fs_fchown
UV_EXTERN int uv_fs_fchown(uv_loop_t *loop, uv_fs_t *req, uv_file file, uv_uid_t uid, uv_gid_t gid, uv_fs_cb cb)
Definition: unix/fs.c:1670
uv_async_init
UV_EXTERN int uv_async_init(uv_loop_t *, uv_async_t *async, uv_async_cb async_cb)
Definition: unix/async.c:44
win.h
uv_signal_s
Definition: uv.h:1561
UV_FS_OPENDIR
@ UV_FS_OPENDIR
Definition: uv.h:1278
uv_buf_t
Definition: unix.h:121
uv_ref
UV_EXTERN void uv_ref(uv_handle_t *)
Definition: uv-common.c:517
UV_FS_ACCESS
@ UV_FS_ACCESS
Definition: uv.h:1259
uv_write_s::send_handle
uv_stream_t * send_handle
Definition: uv.h:525
uv_udp_s::send_queue_size
UV_HANDLE_FIELDS size_t send_queue_size
Definition: uv.h:636
uv_fileno
UV_EXTERN int uv_fileno(const uv_handle_t *handle, uv_os_fd_t *fd)
Definition: unix/core.c:755
UV_FS_WRITE
@ UV_FS_WRITE
Definition: uv.h:1251
uv_udp_bind
UV_EXTERN int uv_udp_bind(uv_udp_t *handle, const struct sockaddr *addr, unsigned int flags)
Definition: uv-common.c:296
UV_FS_EVENT_RECURSIVE
@ UV_FS_EVENT_RECURSIVE
Definition: uv.h:1607
uv_rusage_t::ru_maxrss
uint64_t ru_maxrss
Definition: uv.h:1165
uv_random
UV_EXTERN int uv_random(uv_loop_t *loop, uv_random_t *req, void *buf, size_t buflen, unsigned flags, uv_random_cb cb)
Definition: libuv/src/random.c:94
uv_idle_start
UV_EXTERN int uv_idle_start(uv_idle_t *idle, uv_idle_cb cb)
uv_thread_cb
void(* uv_thread_cb)(void *arg)
Definition: uv.h:1730
key
const char * key
Definition: hpack_parser_table.cc:164
uv_poll_s
Definition: uv.h:783
UV_PROCESS_SETGID
@ UV_PROCESS_SETGID
Definition: uv.h:1000
UV_GETNAMEINFO_PRIVATE_FIELDS
#define UV_GETNAMEINFO_PRIVATE_FIELDS
Definition: unix.h:346
uv_tty_get_winsize
UV_EXTERN int uv_tty_get_winsize(uv_tty_t *, int *width, int *height)
Definition: unix/tty.c:297
uv_shutdown_s::cb
uv_shutdown_cb cb
Definition: uv.h:420
benchmark.FILE
FILE
Definition: benchmark.py:21
uv_async_cb
void(* uv_async_cb)(uv_async_t *handle)
Definition: uv.h:319
uv_tty_set_vterm_state
UV_EXTERN void uv_tty_set_vterm_state(uv_tty_vtermstate_t state)
Definition: unix/tty.c:397
uv_gettimeofday
UV_EXTERN int uv_gettimeofday(uv_timeval64_t *tv)
Definition: unix/core.c:1507
uv_errno_t
uv_errno_t
Definition: uv.h:182
uv_timer_cb
void(* uv_timer_cb)(uv_timer_t *handle)
Definition: uv.h:318
uv_os_setpriority
UV_EXTERN int uv_os_setpriority(uv_pid_t pid, int priority)
Definition: unix/core.c:1419
UV_WORK_PRIVATE_FIELDS
#define UV_WORK_PRIVATE_FIELDS
Definition: unix.h:374
uv_fs_opendir
UV_EXTERN int uv_fs_opendir(uv_loop_t *loop, uv_fs_t *req, const char *path, uv_fs_cb cb)
Definition: unix/fs.c:1865
uv_os_free_environ
UV_EXTERN void uv_os_free_environ(uv_env_item_t *envitems, int count)
Definition: uv-common.c:805
uv_stat_t
Definition: uv.h:346
uv_write_cb
void(* uv_write_cb)(uv_write_t *req, int status)
Definition: uv.h:312
uv_os_unsetenv
UV_EXTERN int uv_os_unsetenv(const char *name)
Definition: unix/core.c:1343
UV_FS_UNKNOWN
@ UV_FS_UNKNOWN
Definition: uv.h:1246
absl::flags_internal
Definition: abseil-cpp/absl/flags/commandlineflag.h:40
UV_FS_COPYFILE
@ UV_FS_COPYFILE
Definition: uv.h:1276
uv_ip6_name
UV_EXTERN int uv_ip6_name(const struct sockaddr_in6 *src, char *dst, size_t size)
Definition: uv-common.c:272
uv_rwlock_t
Definition: win.h:259
uv_udp_set_source_membership
UV_EXTERN int uv_udp_set_source_membership(uv_udp_t *handle, const char *multicast_addr, const char *interface_addr, const char *source_addr, uv_membership membership)
Definition: unix/udp.c:1043
uv_os_fd_t
int uv_os_fd_t
Definition: unix.h:128
server
Definition: examples/python/async_streaming/server.py:1
uv_loop_new
UV_EXTERN uv_loop_t * uv_loop_new(void)
Definition: uv-common.c:745
count
int * count
Definition: bloaty/third_party/googletest/googlemock/test/gmock_stress_test.cc:96
UV_REQ_TYPE_PRIVATE
#define UV_REQ_TYPE_PRIVATE
Definition: unix.h:254
uv_udp_s::send_queue_count
size_t send_queue_count
Definition: uv.h:640
uv_fs_poll_s
Definition: uv.h:1544
async
uv_async_t async
Definition: libuv/docs/code/progress/main.c:8
UV_FS_LUTIME
@ UV_FS_LUTIME
Definition: uv.h:1283
uv_interface_address_s::address4
struct sockaddr_in address4
Definition: uv.h:1090
uv_sem_destroy
UV_EXTERN void uv_sem_destroy(uv_sem_t *sem)
Definition: libuv/src/unix/thread.c:661
uv_mutex_lock
UV_EXTERN void uv_mutex_lock(uv_mutex_t *handle)
Definition: libuv/src/unix/thread.c:329
UV_TCP_PRIVATE_FIELDS
#define UV_TCP_PRIVATE_FIELDS
Definition: unix.h:298
UV_UDP_REUSEADDR
@ UV_UDP_REUSEADDR
Definition: uv.h:608
UV_SIGNAL_PRIVATE_FIELDS
#define UV_SIGNAL_PRIVATE_FIELDS
Definition: unix.h:381
uv_dlsym
UV_EXTERN int uv_dlsym(uv_lib_t *lib, const char *name, void **ptr)
Definition: unix/dl.c:53
uv_udp_open
UV_EXTERN int uv_udp_open(uv_udp_t *handle, uv_os_sock_t sock)
Definition: unix/udp.c:993
UV_PROCESS_WINDOWS_HIDE_GUI
@ UV_PROCESS_WINDOWS_HIDE_GUI
Definition: uv.h:1031
UV_DIR_PRIVATE_FIELDS
#define UV_DIR_PRIVATE_FIELDS
Definition: unix.h:171
UV_REQ_TYPE_MAX
@ UV_REQ_TYPE_MAX
Definition: uv.h:204
UV_FS_CHOWN
@ UV_FS_CHOWN
Definition: uv.h:1273
uv_idle_s
Definition: uv.h:824
uv_fs_write
UV_EXTERN int uv_fs_write(uv_loop_t *loop, uv_fs_t *req, uv_file file, const uv_buf_t bufs[], unsigned int nbufs, int64_t offset, uv_fs_cb cb)
Definition: unix/fs.c:1995
walk_cb
static void walk_cb(uv_handle_t *handle, void *arg)
Definition: test-walk-handles.c:33
uv_udp_get_send_queue_count
UV_EXTERN size_t uv_udp_get_send_queue_count(const uv_udp_t *handle)
Definition: uv-data-getter-setters.c:64
uv_loop_s::active_reqs
union uv_loop_s::@402 active_reqs
uv_pipe_pending_type
UV_EXTERN uv_handle_type uv_pipe_pending_type(uv_pipe_t *handle)
Definition: unix/pipe.c:315
uv_interface_address_s::netmask6
struct sockaddr_in6 netmask6
Definition: uv.h:1095
uv_connection_cb
void(* uv_connection_cb)(uv_stream_t *server, int status)
Definition: uv.h:315
uv_hrtime
UV_EXTERN uint64_t uv_hrtime(void)
Definition: unix/core.c:107
uv_tcp_flags
uv_tcp_flags
Definition: uv.h:559
uv_fs_event_cb
void(* uv_fs_event_cb)(uv_fs_event_t *handle, const char *filename, int events, int status)
Definition: uv.h:366
uv_key_set
UV_EXTERN void uv_key_set(uv_key_t *key, void *value)
Definition: libuv/src/unix/thread.c:849
uv_inet_ntop
UV_EXTERN int uv_inet_ntop(int af, const void *src, char *dst, size_t size)
Definition: inet.c:40
uv_stat_t::st_dev
uint64_t st_dev
Definition: uv.h:347
uv_poll_stop
UV_EXTERN int uv_poll_stop(uv_poll_t *handle)
Definition: unix/poll.c:111
UV_CONNECT_PRIVATE_FIELDS
#define UV_CONNECT_PRIVATE_FIELDS
Definition: unix.h:268
uv_replace_allocator
UV_EXTERN int uv_replace_allocator(uv_malloc_func malloc_func, uv_realloc_func realloc_func, uv_calloc_func calloc_func, uv_free_func free_func)
Definition: uv-common.c:114
uv_fs_link
UV_EXTERN int uv_fs_link(uv_loop_t *loop, uv_fs_t *req, const char *path, const char *new_path, uv_fs_cb cb)
Definition: unix/fs.c:1765
uv_rusage_t::ru_nswap
uint64_t ru_nswap
Definition: uv.h:1171
uv_statfs_s::f_bsize
uint64_t f_bsize
Definition: uv.h:1119
getaddrinfo_cb
static void getaddrinfo_cb(uv_getaddrinfo_t *handle, int status, struct addrinfo *res)
Definition: benchmark-getaddrinfo.c:44
uv_tty_init
UV_EXTERN int uv_tty_init(uv_loop_t *, uv_tty_t *, uv_file fd, int readable)
Definition: unix/tty.c:123
uv_tty_set_mode
UV_EXTERN int uv_tty_set_mode(uv_tty_t *, uv_tty_mode_t mode)
Definition: unix/tty.c:250
UV_LOOP_PRIVATE_FIELDS
#define UV_LOOP_PRIVATE_FIELDS
Definition: unix.h:221
uv_stat_t::st_flags
uint64_t st_flags
Definition: uv.h:357
uv_fs_chown
UV_EXTERN int uv_fs_chown(uv_loop_t *loop, uv_fs_t *req, const char *path, uv_uid_t uid, uv_gid_t gid, uv_fs_cb cb)
Definition: unix/fs.c:1637
uv_loop_delete
UV_EXTERN void uv_loop_delete(uv_loop_t *)
Definition: uv-common.c:791
uv_statfs_s::f_spare
uint64_t f_spare[4]
Definition: uv.h:1125
uv_getrusage
UV_EXTERN int uv_getrusage(uv_rusage_t *rusage)
Definition: unix/core.c:958
UV_UDP_PRIVATE_FIELDS
#define UV_UDP_PRIVATE_FIELDS
Definition: unix.h:300
UV_PROCESS_DETACHED
@ UV_PROCESS_DETACHED
Definition: uv.h:1014
UV_FS_SENDFILE
@ UV_FS_SENDFILE
Definition: uv.h:1252
uv_pipe_s::ipc
UV_HANDLE_FIELDS UV_STREAM_FIELDS int ipc
Definition: uv.h:760
arg
struct arg arg
uv_cond_init
UV_EXTERN int uv_cond_init(uv_cond_t *cond)
Definition: libuv/src/unix/thread.c:703
state
Definition: bloaty/third_party/zlib/contrib/blast/blast.c:41
UV_LEAVE_GROUP
@ UV_LEAVE_GROUP
Definition: uv.h:380
UV_RUN_ONCE
@ UV_RUN_ONCE
Definition: uv.h:255
UV_FS_FDATASYNC
@ UV_FS_FDATASYNC
Definition: uv.h:1263
uv_fs_closedir
UV_EXTERN int uv_fs_closedir(uv_loop_t *loop, uv_fs_t *req, uv_dir_t *dir, uv_fs_cb cb)
Definition: unix/fs.c:1887
uv_pipe_s
Definition: uv.h:757
uv_fs_rename
UV_EXTERN int uv_fs_rename(uv_loop_t *loop, uv_fs_t *req, const char *path, const char *new_path, uv_fs_cb cb)
Definition: unix/fs.c:1920
uv_buf_init
UV_EXTERN uv_buf_t uv_buf_init(char *base, unsigned int len)
Definition: uv-common.c:157
uv_malloc_func
void *(* uv_malloc_func)(size_t size)
Definition: uv.h:263
uv_check_init
UV_EXTERN int uv_check_init(uv_loop_t *, uv_check_t *check)
check
static void check(upb_inttable *t)
Definition: bloaty/third_party/protobuf/php/ext/google/protobuf/upb.c:1715
uv_any_handle
Definition: uv.h:1757
uv_tcp_nodelay
UV_EXTERN int uv_tcp_nodelay(uv_tcp_t *handle, int enable)
Definition: unix/tcp.c:407
uv_stop
UV_EXTERN void uv_stop(uv_loop_t *)
Definition: uv-common.c:532
uv_os_homedir
UV_EXTERN int uv_os_homedir(char *buffer, size_t *size)
Definition: unix/core.c:1047
uv_handle_set_data
UV_EXTERN void uv_handle_set_data(uv_handle_t *handle, void *data)
Definition: uv-data-getter-setters.c:27
uv_interface_address_s::is_internal
int is_internal
Definition: uv.h:1088
uv_loop_configure
UV_EXTERN int uv_loop_configure(uv_loop_t *loop, uv_loop_option option,...)
Definition: uv-common.c:716
UV_FS_OPEN
@ UV_FS_OPEN
Definition: uv.h:1248
uv_fs_realpath
UV_EXTERN int uv_fs_realpath(uv_loop_t *loop, uv_fs_t *req, const char *path, uv_fs_cb cb)
Definition: unix/fs.c:1910
UV_CREATE_PIPE
@ UV_CREATE_PIPE
Definition: uv.h:912
UV_FS_SCANDIR
@ UV_FS_SCANDIR
Definition: uv.h:1269
uv_write_s
Definition: uv.h:522
UV_FS_RMDIR
@ UV_FS_RMDIR
Definition: uv.h:1265
uv_mutex_trylock
UV_EXTERN int uv_mutex_trylock(uv_mutex_t *handle)
Definition: libuv/src/unix/thread.c:335
uv_rwlock_rdunlock
UV_EXTERN void uv_rwlock_rdunlock(uv_rwlock_t *rwlock)
Definition: libuv/src/unix/thread.c:386
uv_getaddrinfo
UV_EXTERN int uv_getaddrinfo(uv_loop_t *loop, uv_getaddrinfo_t *req, uv_getaddrinfo_cb getaddrinfo_cb, const char *node, const char *service, const struct addrinfo *hints)
Definition: unix/getaddrinfo.c:141
uv_fs_event_start
UV_EXTERN int uv_fs_event_start(uv_fs_event_t *handle, uv_fs_event_cb cb, const char *path, unsigned int flags)
Definition: aix.c:727
uv_cond_signal
UV_EXTERN void uv_cond_signal(uv_cond_t *cond)
Definition: libuv/src/unix/thread.c:770
uv_handle_get_type
UV_EXTERN uv_handle_type uv_handle_get_type(const uv_handle_t *handle)
Definition: uv-data-getter-setters.c:15
uv_fs_req_cleanup
UV_EXTERN void uv_fs_req_cleanup(uv_fs_t *req)
Definition: unix/fs.c:2024
uv_timeval_t::tv_usec
long tv_usec
Definition: uv.h:1154
uv_udp_send_s::handle
UV_REQ_FIELDS uv_udp_t * handle
Definition: uv.h:647
UV_FS_SYMLINK
@ UV_FS_SYMLINK
Definition: uv.h:1271
uv_process_flags
uv_process_flags
Definition: uv.h:988
uv_statfs_s::f_bfree
uint64_t f_bfree
Definition: uv.h:1121
UV_LOOP_BLOCK_SIGNAL
@ UV_LOOP_BLOCK_SIGNAL
Definition: uv.h:250
uv_mutex_init_recursive
UV_EXTERN int uv_mutex_init_recursive(uv_mutex_t *handle)
Definition: libuv/src/unix/thread.c:304
uv_stdio_container_s::data
union uv_stdio_container_s::@399 data
uv_fs_s::fs_type
UV_REQ_FIELDS uv_fs_type fs_type
Definition: uv.h:1296
UV_UNKNOWN_REQ
@ UV_UNKNOWN_REQ
Definition: uv.h:199
uv_handle_size
UV_EXTERN size_t uv_handle_size(uv_handle_type type)
Definition: uv-common.c:133
uv_signal_s::signum
int signum
Definition: uv.h:1564
UV_PROCESS_WINDOWS_VERBATIM_ARGUMENTS
@ UV_PROCESS_WINDOWS_VERBATIM_ARGUMENTS
Definition: uv.h:1006
handle
static csh handle
Definition: test_arm_regression.c:16
uv_rusage_t::ru_utime
uv_timeval_t ru_utime
Definition: uv.h:1163
uv_timespec_t
Definition: uv.h:340
uv_interface_address_s::address
union uv_interface_address_s::@400 address
uv_open_osfhandle
UV_EXTERN int uv_open_osfhandle(uv_os_fd_t os_fd)
Definition: unix/core.c:1388
UV_FS_MKDIR
@ UV_FS_MKDIR
Definition: uv.h:1266
uv_handle_s
Definition: uv.h:441
UV_DISCONNECT
@ UV_DISCONNECT
Definition: uv.h:792
uv_timer_start
UV_EXTERN int uv_timer_start(uv_timer_t *handle, uv_timer_cb cb, uint64_t timeout, uint64_t repeat)
Definition: timer.c:66
test_server.socket
socket
Definition: test_server.py:65
after_work_cb
static void after_work_cb(uv_work_t *req, int status)
Definition: test-fork.c:615
uv_dlerror
const UV_EXTERN char * uv_dlerror(const uv_lib_t *lib)
Definition: unix/dl.c:60
uv_thread_t
pthread_t uv_thread_t
Definition: unix.h:134
uv_interface_address_s::phys_addr
char phys_addr[6]
Definition: uv.h:1087
uv_work_s::loop
UV_REQ_FIELDS uv_loop_t * loop
Definition: uv.h:1057
uv_has_ref
UV_EXTERN int uv_has_ref(const uv_handle_t *)
Definition: uv-common.c:527
uv_interface_address_s::netmask4
struct sockaddr_in netmask4
Definition: uv.h:1094
uv_loop_s
Definition: uv.h:1767
flags
uint32_t flags
Definition: retry_filter.cc:632
uv_close_cb
void(* uv_close_cb)(uv_handle_t *handle)
Definition: uv.h:316
UV_POLL_PRIVATE_FIELDS
#define UV_POLL_PRIVATE_FIELDS
Definition: unix.h:310
uv_sem_wait
UV_EXTERN void uv_sem_wait(uv_sem_t *sem)
Definition: libuv/src/unix/thread.c:677
uv_write2
UV_EXTERN int uv_write2(uv_write_t *req, uv_stream_t *handle, const uv_buf_t bufs[], unsigned int nbufs, uv_stream_t *send_handle, uv_write_cb cb)
Definition: unix/stream.c:1393
asyncio_get_stats.type
type
Definition: asyncio_get_stats.py:37
uv_prepare_cb
void(* uv_prepare_cb)(uv_prepare_t *handle)
Definition: uv.h:320
uv_rusage_t::ru_inblock
uint64_t ru_inblock
Definition: uv.h:1172
uv_udp_set_ttl
UV_EXTERN int uv_udp_set_ttl(uv_udp_t *handle, int ttl)
Definition: unix/udp.c:1148
uv_stat_t::st_blocks
uint64_t st_blocks
Definition: uv.h:356
len
int len
Definition: abseil-cpp/absl/base/internal/low_level_alloc_test.cc:46
uv_timer_init
UV_EXTERN int uv_timer_init(uv_loop_t *, uv_timer_t *handle)
Definition: timer.c:58
uv_fs_s::ptr
void * ptr
Definition: uv.h:1300
UV_ERRNO_MAX
@ UV_ERRNO_MAX
Definition: uv.h:186
uv_udp_try_send
UV_EXTERN int uv_udp_try_send(uv_udp_t *handle, const uv_buf_t bufs[], unsigned int nbufs, const struct sockaddr *addr)
Definition: uv-common.c:424
uv_is_writable
UV_EXTERN int uv_is_writable(const uv_stream_t *handle)
Definition: unix/stream.c:1611
uv_udp_recv_stop
UV_EXTERN int uv_udp_recv_stop(uv_udp_t *handle)
Definition: uv-common.c:448
uv_fs_event_init
UV_EXTERN int uv_fs_event_init(uv_loop_t *loop, uv_fs_event_t *handle)
Definition: aix.c:717
uv_pipe_chmod
UV_EXTERN int uv_pipe_chmod(uv_pipe_t *handle, int flags)
Definition: unix/pipe.c:326
service
__attribute__((deprecated("Please use GRPCProtoMethod."))) @interface ProtoMethod NSString * service
Definition: ProtoMethod.h:25
uv_pipe_bind
UV_EXTERN int uv_pipe_bind(uv_pipe_t *handle, const char *name)
Definition: unix/pipe.c:43
UV_EXTERN
#define UV_EXTERN
Definition: uv.h:49
UV_FS_STATFS
@ UV_FS_STATFS
Definition: uv.h:1281
size
voidpf void uLong size
Definition: bloaty/third_party/zlib/contrib/minizip/ioapi.h:136
uv_key_create
UV_EXTERN int uv_key_create(uv_key_t *key)
Definition: libuv/src/unix/thread.c:833
UV_PROCESS_WINDOWS_HIDE_CONSOLE
@ UV_PROCESS_WINDOWS_HIDE_CONSOLE
Definition: uv.h:1025
uv_cancel
UV_EXTERN int uv_cancel(uv_req_t *req)
Definition: threadpool.c:358
uv_process_kill
UV_EXTERN int uv_process_kill(uv_process_t *, int signum)
Definition: unix/process.c:577
uv_work_s
Definition: uv.h:1055
uv_fs_lchown
UV_EXTERN int uv_fs_lchown(uv_loop_t *loop, uv_fs_t *req, const char *path, uv_uid_t uid, uv_gid_t gid, uv_fs_cb cb)
Definition: unix/fs.c:1684
uv_idle_cb
void(* uv_idle_cb)(uv_idle_t *handle)
Definition: uv.h:322
length
std::size_t length
Definition: abseil-cpp/absl/time/internal/test_util.cc:57
uv_os_getppid
UV_EXTERN uv_pid_t uv_os_getppid(void)
Definition: unix/core.c:1397
UV_REQ_FIELDS
#define UV_REQ_FIELDS
Definition: uv.h:394
uv_os_tmpdir
UV_EXTERN int uv_os_tmpdir(char *buffer, size_t *size)
Definition: unix/core.c:1083
uv_stdio_container_t
struct uv_stdio_container_s uv_stdio_container_t
UV__EOF
#define UV__EOF
Definition: errno.h:32
uv_fs_lstat
UV_EXTERN int uv_fs_lstat(uv_loop_t *loop, uv_fs_t *req, const char *path, uv_fs_cb cb)
Definition: unix/fs.c:1758
int32_t
signed int int32_t
Definition: stdint-msvc2008.h:77
UV_UDP_SEND_PRIVATE_FIELDS
#define UV_UDP_SEND_PRIVATE_FIELDS
Definition: unix.h:273
uv_cpu_info_s::speed
int speed
Definition: uv.h:1081
uv_read_stop
UV_EXTERN int uv_read_stop(uv_stream_t *)
Definition: unix/stream.c:1590
uv_cpu_times_s::sys
uint64_t sys
Definition: uv.h:1074
uv_resident_set_memory
UV_EXTERN int uv_resident_set_memory(size_t *rss)
Definition: aix.c:935
uv_handle_get_data
UV_EXTERN void * uv_handle_get_data(const uv_handle_t *handle)
Definition: uv-data-getter-setters.c:19
uv_loadavg
UV_EXTERN void uv_loadavg(double avg[3])
Definition: aix.c:352
uv_barrier_wait
UV_EXTERN int uv_barrier_wait(uv_barrier_t *barrier)
Definition: libuv/src/unix/thread.c:89
t1
Table t1
Definition: abseil-cpp/absl/container/internal/raw_hash_set_allocator_test.cc:185
uv_statfs_s::f_type
uint64_t f_type
Definition: uv.h:1118
uv_dirent_type_t
uv_dirent_type_t
Definition: uv.h:1128
UV_SHUTDOWN_PRIVATE_FIELDS
#define UV_SHUTDOWN_PRIVATE_FIELDS
Definition: unix.h:271
uv_tty_get_vterm_state
UV_EXTERN int uv_tty_get_vterm_state(uv_tty_vtermstate_t *state)
Definition: unix/tty.c:400
rwlock
static uv_rwlock_t rwlock
Definition: test-mutexes.c:30
uv_fs_poll_getpath
UV_EXTERN int uv_fs_poll_getpath(uv_fs_poll_t *handle, char *buffer, size_t *size)
Definition: fs-poll.c:138
uv_udp_init_ex
UV_EXTERN int uv_udp_init_ex(uv_loop_t *, uv_udp_t *handle, unsigned int flags)
Definition: unix/udp.c:947
stdint-msvc2008.h
UV_FS_FSTAT
@ UV_FS_FSTAT
Definition: uv.h:1255
uv_process_options_t
struct uv_process_options_s uv_process_options_t
uv_err_name
const UV_EXTERN char * uv_err_name(int err)
Definition: uv-common.c:189
uv_process_s::exit_cb
UV_HANDLE_FIELDS uv_exit_cb exit_cb
Definition: uv.h:1039
uv_rwlock_trywrlock
UV_EXTERN int uv_rwlock_trywrlock(uv_rwlock_t *rwlock)
Definition: libuv/src/unix/thread.c:398
uv_pipe_pending_instances
UV_EXTERN void uv_pipe_pending_instances(uv_pipe_t *handle, int count)
Definition: unix/pipe.c:294
uv_tty_reset_mode
UV_EXTERN int uv_tty_reset_mode(void)
Definition: unix/tty.c:378
google_benchmark.option
option
Definition: third_party/benchmark/bindings/python/google_benchmark/__init__.py:115
version.h
addrinfo
Definition: ares_ipv6.h:43
uv_pipe_open
UV_EXTERN int uv_pipe_open(uv_pipe_t *, uv_file file)
Definition: unix/pipe.c:137
uv_fs_scandir_next
UV_EXTERN int uv_fs_scandir_next(uv_fs_t *req, uv_dirent_t *ent)
Definition: uv-common.c:621
uv_get_process_title
UV_EXTERN int uv_get_process_title(char *buffer, size_t size)
Definition: aix.c:906
addr
struct sockaddr_in addr
Definition: libuv/docs/code/tcp-echo-server/main.c:10
uv_gid_t
gid_t uv_gid_t
Definition: unix.h:166
uv_req_s
Definition: uv.h:404
uv_poll_s::poll_cb
UV_HANDLE_FIELDS uv_poll_cb poll_cb
Definition: uv.h:785
UV_DIRENT_UNKNOWN
@ UV_DIRENT_UNKNOWN
Definition: uv.h:1129
UV_DIRENT_DIR
@ UV_DIRENT_DIR
Definition: uv.h:1131
UV_REQ_TYPE_MAP
#define UV_REQ_TYPE_MAP(XX)
Definition: uv.h:170
uv_fs_fstat
UV_EXTERN int uv_fs_fstat(uv_loop_t *loop, uv_fs_t *req, uv_file file, uv_fs_cb cb)
Definition: unix/fs.c:1705
timeout
uv_timer_t timeout
Definition: libuv/docs/code/uvwget/main.c:9
errno.h
cb
OPENSSL_EXPORT pem_password_cb * cb
Definition: pem.h:351
uv_process_get_pid
UV_EXTERN uv_pid_t uv_process_get_pid(const uv_process_t *)
Definition: uv-data-getter-setters.c:68
UV_FS_REALPATH
@ UV_FS_REALPATH
Definition: uv.h:1275
uv_dir_s::dirents
uv_dirent_t * dirents
Definition: uv.h:1287
offset
voidpf uLong offset
Definition: bloaty/third_party/zlib/contrib/minizip/ioapi.h:142
uv_interface_address_s::address6
struct sockaddr_in6 address6
Definition: uv.h:1091
UV_HANDLE_TYPE_MAX
@ UV_HANDLE_TYPE_MAX
Definition: uv.h:195
uv_loop_s::unused
void * unused[2]
Definition: uv.h:1774
height
int height
Definition: libuv/docs/code/tty-gravity/main.c:10
uv_signal_start
UV_EXTERN int uv_signal_start(uv_signal_t *handle, uv_signal_cb signal_cb, int signum)
Definition: unix/signal.c:338
uv_utsname_s
Definition: uv.h:1107
uv_cpu_times_s::idle
uint64_t idle
Definition: uv.h:1075
uv_rwlock_rdlock
UV_EXTERN void uv_rwlock_rdlock(uv_rwlock_t *rwlock)
Definition: libuv/src/unix/thread.c:366
UV_FS_RENAME
@ UV_FS_RENAME
Definition: uv.h:1268
uv_async_send
UV_EXTERN int uv_async_send(uv_async_t *async)
Definition: unix/async.c:62
uv_check_start
UV_EXTERN int uv_check_start(uv_check_t *check, uv_check_cb cb)
UV_UNKNOWN_HANDLE
@ UV_UNKNOWN_HANDLE
Definition: uv.h:190
stream
voidpf stream
Definition: bloaty/third_party/zlib/contrib/minizip/ioapi.h:136


grpc
Author(s):
autogenerated on Thu Mar 13 2025 03:01:49